There was an error while loading. Please reload this page.
1 parent 562645a commit 0e13e74Copy full SHA for 0e13e74
nav2_costmap_2d/src/costmap_topic_collision_checker.cpp
@@ -85,7 +85,7 @@ double CostmapTopicCollisionChecker::scorePose(
85
return collision_checker_.footprintCost(getFootprint(pose));
86
}
87
88
-Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & /*pose*/)
+Footprint CostmapTopicCollisionChecker::getFootprint(const geometry_msgs::msg::Pose2D & pose)
89
{
90
Footprint footprint;
91
if (!footprint_sub_.getFootprint(footprint)) {
0 commit comments