Public Member Functions | Private Member Functions | Private Attributes | List of all members
move_slow_and_clear::MoveSlowAndClear Class Reference

#include <move_slow_and_clear.h>

Inheritance diagram for move_slow_and_clear::MoveSlowAndClear:
Inheritance graph
[legend]

Public Member Functions

void initialize (std::string n, tf2_ros::Buffer *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::Costmap2DROSglobal_costmap_
 
bool initialized_
 
bool limit_set_
 
double limited_distance_
 
double limited_rot_speed_
 
double limited_trans_speed_
 
costmap_2d::Costmap2DROSlocal_costmap_
 
std::string max_rot_param_name_
 
std::string max_trans_param_name_
 
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_
 
geometry_msgs::PoseStamped speed_limit_pose_
 

Additional Inherited Members

- Protected Member Functions inherited from nav_core::RecoveryBehavior
 RecoveryBehavior ()
 

Detailed Description

Definition at line 48 of file move_slow_and_clear.h.

Constructor & Destructor Documentation

◆ MoveSlowAndClear()

move_slow_and_clear::MoveSlowAndClear::MoveSlowAndClear ( )

Definition at line 45 of file move_slow_and_clear.cpp.

◆ ~MoveSlowAndClear()

move_slow_and_clear::MoveSlowAndClear::~MoveSlowAndClear ( )

Definition at line 48 of file move_slow_and_clear.cpp.

Member Function Documentation

◆ distanceCheck()

void move_slow_and_clear::MoveSlowAndClear::distanceCheck ( const ros::TimerEvent e)
private

Definition at line 169 of file move_slow_and_clear.cpp.

◆ getSqDistance()

double move_slow_and_clear::MoveSlowAndClear::getSqDistance ( )
private

Definition at line 156 of file move_slow_and_clear.cpp.

◆ initialize()

void move_slow_and_clear::MoveSlowAndClear::initialize ( std::string  n,
tf2_ros::Buffer tf,
costmap_2d::Costmap2DROS global_costmap,
costmap_2d::Costmap2DROS local_costmap 
)
virtual

Initialize the parameters of the behavior.

Implements nav_core::RecoveryBehavior.

Definition at line 53 of file move_slow_and_clear.cpp.

◆ removeSpeedLimit()

void move_slow_and_clear::MoveSlowAndClear::removeSpeedLimit ( )
private

Definition at line 186 of file move_slow_and_clear.cpp.

◆ runBehavior()

void move_slow_and_clear::MoveSlowAndClear::runBehavior ( )
virtual

Run the behavior.

Implements nav_core::RecoveryBehavior.

Definition at line 75 of file move_slow_and_clear.cpp.

◆ setRobotSpeed()

void move_slow_and_clear::MoveSlowAndClear::setRobotSpeed ( double  trans_speed,
double  rot_speed 
)
private

Definition at line 193 of file move_slow_and_clear.cpp.

Member Data Documentation

◆ clearing_distance_

double move_slow_and_clear::MoveSlowAndClear::clearing_distance_
private

Definition at line 73 of file move_slow_and_clear.h.

◆ distance_check_timer_

ros::Timer move_slow_and_clear::MoveSlowAndClear::distance_check_timer_
private

Definition at line 76 of file move_slow_and_clear.h.

◆ global_costmap_

costmap_2d::Costmap2DROS* move_slow_and_clear::MoveSlowAndClear::global_costmap_
private

Definition at line 70 of file move_slow_and_clear.h.

◆ initialized_

bool move_slow_and_clear::MoveSlowAndClear::initialized_
private

Definition at line 72 of file move_slow_and_clear.h.

◆ limit_set_

bool move_slow_and_clear::MoveSlowAndClear::limit_set_
private

Definition at line 80 of file move_slow_and_clear.h.

◆ limited_distance_

double move_slow_and_clear::MoveSlowAndClear::limited_distance_
private

Definition at line 73 of file move_slow_and_clear.h.

◆ limited_rot_speed_

double move_slow_and_clear::MoveSlowAndClear::limited_rot_speed_
private

Definition at line 74 of file move_slow_and_clear.h.

◆ limited_trans_speed_

double move_slow_and_clear::MoveSlowAndClear::limited_trans_speed_
private

Definition at line 74 of file move_slow_and_clear.h.

◆ local_costmap_

costmap_2d::Costmap2DROS* move_slow_and_clear::MoveSlowAndClear::local_costmap_
private

Definition at line 71 of file move_slow_and_clear.h.

◆ max_rot_param_name_

std::string move_slow_and_clear::MoveSlowAndClear::max_rot_param_name_
private

Definition at line 75 of file move_slow_and_clear.h.

◆ max_trans_param_name_

std::string move_slow_and_clear::MoveSlowAndClear::max_trans_param_name_
private

Definition at line 75 of file move_slow_and_clear.h.

◆ mutex_

boost::mutex move_slow_and_clear::MoveSlowAndClear::mutex_
private

Definition at line 79 of file move_slow_and_clear.h.

◆ old_rot_speed_

double move_slow_and_clear::MoveSlowAndClear::old_rot_speed_
private

Definition at line 74 of file move_slow_and_clear.h.

◆ old_trans_speed_

double move_slow_and_clear::MoveSlowAndClear::old_trans_speed_
private

Definition at line 74 of file move_slow_and_clear.h.

◆ planner_dynamic_reconfigure_service_

ros::ServiceClient move_slow_and_clear::MoveSlowAndClear::planner_dynamic_reconfigure_service_
private

Definition at line 81 of file move_slow_and_clear.h.

◆ planner_nh_

ros::NodeHandle move_slow_and_clear::MoveSlowAndClear::planner_nh_
private

Definition at line 69 of file move_slow_and_clear.h.

◆ private_nh_

ros::NodeHandle move_slow_and_clear::MoveSlowAndClear::private_nh_
private

Definition at line 69 of file move_slow_and_clear.h.

◆ remove_limit_thread_

boost::thread* move_slow_and_clear::MoveSlowAndClear::remove_limit_thread_
private

Definition at line 78 of file move_slow_and_clear.h.

◆ speed_limit_pose_

geometry_msgs::PoseStamped move_slow_and_clear::MoveSlowAndClear::speed_limit_pose_
private

Definition at line 77 of file move_slow_and_clear.h.


The documentation for this class was generated from the following files:


move_slow_and_clear
Author(s): Eitan Marder-Eppstein, contradict@gmail.com
autogenerated on Wed Jun 22 2022 02:07:17