57 const geometry_msgs::Pose2D& goal,
const nav_2d_msgs::Path2D& global_plan)
61 ROS_ERROR_NAMED(
"ObstacleFootprintCritic",
"Footprint spec is empty, maybe missing call to setFootprint?");
69 unsigned int cell_x, cell_y;
76 const nav_2d_msgs::Polygon2D& footprint)
78 unsigned char footprint_cost = 0;
82 unsigned char cost =
costmap(index.x, index.y);
92 footprint_cost = std::max(cost, footprint_cost);
96 return footprint_cost;