#include <move_slow_and_clear.h>
Public Member Functions | |
void | initialize (std::string n, tf::TransformListener *tf, costmap_2d::Costmap2DROS *global_costmap, costmap_2d::Costmap2DROS *local_costmap) |
Initialize the parameters of the behavior. More... | |
MoveSlowAndClear () | |
void | runBehavior () |
Run the behavior. More... | |
~MoveSlowAndClear () | |
Public Member Functions inherited from nav_core::RecoveryBehavior | |
virtual | ~RecoveryBehavior () |
Private Member Functions | |
void | distanceCheck (const ros::TimerEvent &e) |
double | getSqDistance () |
void | removeSpeedLimit () |
void | setRobotSpeed (double trans_speed, double rot_speed) |
Private Attributes | |
double | clearing_distance_ |
ros::Timer | distance_check_timer_ |
costmap_2d::Costmap2DROS * | global_costmap_ |
bool | initialized_ |
bool | limit_set_ |
double | limited_distance_ |
double | limited_rot_speed_ |
double | limited_trans_speed_ |
costmap_2d::Costmap2DROS * | local_costmap_ |
boost::mutex | mutex_ |
double | old_rot_speed_ |
double | old_trans_speed_ |
ros::ServiceClient | planner_dynamic_reconfigure_service_ |
ros::NodeHandle | planner_nh_ |
ros::NodeHandle | private_nh_ |
boost::thread * | remove_limit_thread_ |
tf::Stamped< tf::Pose > | speed_limit_pose_ |
Additional Inherited Members | |
Protected Member Functions inherited from nav_core::RecoveryBehavior | |
RecoveryBehavior () | |
Definition at line 48 of file move_slow_and_clear.h.
move_slow_and_clear::MoveSlowAndClear::MoveSlowAndClear | ( | ) |
Definition at line 45 of file move_slow_and_clear.cpp.
move_slow_and_clear::MoveSlowAndClear::~MoveSlowAndClear | ( | ) |
Definition at line 48 of file move_slow_and_clear.cpp.
|
private |
Definition at line 167 of file move_slow_and_clear.cpp.
|
private |
Definition at line 154 of file move_slow_and_clear.cpp.
|
virtual |
Initialize the parameters of the behavior.
Implements nav_core::RecoveryBehavior.
Definition at line 53 of file move_slow_and_clear.cpp.
|
private |
Definition at line 184 of file move_slow_and_clear.cpp.
|
virtual |
Run the behavior.
Implements nav_core::RecoveryBehavior.
Definition at line 73 of file move_slow_and_clear.cpp.
|
private |
Definition at line 191 of file move_slow_and_clear.cpp.
|
private |
Definition at line 73 of file move_slow_and_clear.h.
|
private |
Definition at line 75 of file move_slow_and_clear.h.
|
private |
Definition at line 70 of file move_slow_and_clear.h.
|
private |
Definition at line 72 of file move_slow_and_clear.h.
|
private |
Definition at line 79 of file move_slow_and_clear.h.
|
private |
Definition at line 73 of file move_slow_and_clear.h.
|
private |
Definition at line 74 of file move_slow_and_clear.h.
|
private |
Definition at line 74 of file move_slow_and_clear.h.
|
private |
Definition at line 71 of file move_slow_and_clear.h.
|
private |
Definition at line 78 of file move_slow_and_clear.h.
|
private |
Definition at line 74 of file move_slow_and_clear.h.
|
private |
Definition at line 74 of file move_slow_and_clear.h.
|
private |
Definition at line 80 of file move_slow_and_clear.h.
|
private |
Definition at line 69 of file move_slow_and_clear.h.
|
private |
Definition at line 69 of file move_slow_and_clear.h.
|
private |
Definition at line 77 of file move_slow_and_clear.h.
|
private |
Definition at line 76 of file move_slow_and_clear.h.