Skip to content

Commit 0e13e74

Browse files
committed
Fix commented Varible
1 parent 562645a commit 0e13e74

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

‎nav2_costmap_2d/src/costmap_topic_collision_checker.cpp‎

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -85,7 +85,7 @@ double CostmapTopicCollisionChecker::scorePose(
8585
return collision_checker_.footprintCost(getFootprint(pose));
8686
}
8787

88-
Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & /*pose*/)
88+
Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & pose)
8989
{
9090
Footprint footprint;
9191
if (!footprint_sub_.getFootprint(footprint)) {

0 commit comments

Comments
 (0)