35 #ifndef DWB_CRITICS_OBSTACLE_FOOTPRINT_H    36 #define DWB_CRITICS_OBSTACLE_FOOTPRINT_H    39 #include <nav_2d_msgs/Polygon2D.h>    59   bool prepare(
const geometry_msgs::Pose2D& pose, 
const nav_2d_msgs::Twist2D& vel,
    60                const geometry_msgs::Pose2D& goal, 
const nav_2d_msgs::Path2D& global_plan) 
override;
    63                            const nav_2d_msgs::Polygon2D& oriented_footprint);
    70 #endif  // DWB_CRITICS_OBSTACLE_FOOTPRINT_H nav_core2::BasicCostmap costmap
Uses costmap to assign negative costs if a circular robot would collide at any point of the trajector...
nav_core2::Costmap::Ptr costmap_