37 #ifndef MOVE_SLOW_AND_CLEAR_MOVE_SLOW_AND_CLEAR_H_ 38 #define MOVE_SLOW_AND_CLEAR_MOVE_SLOW_AND_CLEAR_H_ 43 #include <boost/thread.hpp> 44 #include <dynamic_reconfigure/Reconfigure.h>
costmap_2d::Costmap2DROS * local_costmap_
ros::NodeHandle private_nh_
tf::Stamped< tf::Pose > speed_limit_pose_
ros::Timer distance_check_timer_
double limited_rot_speed_
void initialize(std::string n, tf::TransformListener *tf, costmap_2d::Costmap2DROS *global_costmap, costmap_2d::Costmap2DROS *local_costmap)
Initialize the parameters of the behavior.
double limited_trans_speed_
void setRobotSpeed(double trans_speed, double rot_speed)
ros::NodeHandle planner_nh_
void distanceCheck(const ros::TimerEvent &e)
costmap_2d::Costmap2DROS * global_costmap_
void runBehavior()
Run the behavior.
double clearing_distance_
ros::ServiceClient planner_dynamic_reconfigure_service_
boost::thread * remove_limit_thread_