35 #ifndef DWB_CRITICS_BASE_OBSTACLE_H 36 #define DWB_CRITICS_BASE_OBSTACLE_H 79 #endif // DWB_CRITICS_BASE_OBSTACLE_H
double scoreTrajectory(const dwb_msgs::Trajectory2D &traj) override
nav_core2::BasicCostmap costmap
virtual double scorePose(const nav_core2::Costmap &costmap, const geometry_msgs::Pose2D &pose)
Return the obstacle score for a particular pose.
void addCriticVisualization(sensor_msgs::PointCloud &pc) override
Uses costmap to assign negative costs if a circular robot would collide at any point of the trajector...
virtual bool isValidCost(const unsigned char cost)
Check to see whether a given cell cost is valid for driving through.