Skip to content

Commit

Permalink
Fix commented Varible
Browse files Browse the repository at this point in the history
  • Loading branch information
shivaang12 committed May 14, 2020
1 parent 82e7931 commit 87dfc8d
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion nav2_costmap_2d/src/costmap_topic_collision_checker.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -85,7 +85,7 @@ double CostmapTopicCollisionChecker::scorePose(
return collision_checker_.footprintCost(getFootprint(pose));
}

Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & /*pose*/)
Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & pose)
{
Footprint footprint;
if (!footprint_sub_.getFootprint(footprint)) {
Expand Down

0 comments on commit 87dfc8d

Please sign in to comment.