move_slow_and_clear::MoveSlowAndClear Class Reference

#include <move_slow_and_clear.h>

List of all members.

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.
 MoveSlowAndClear ()
void runBehavior ()
 Run the behavior.
 ~MoveSlowAndClear ()

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::NodeHandle planner_nh_
ros::NodeHandle private_nh_
boost::thread * remove_limit_thread_
tf::Stamped< tf::Pose > speed_limit_pose_

Detailed Description

Definition at line 43 of file move_slow_and_clear.h.


Constructor & Destructor Documentation

move_slow_and_clear::MoveSlowAndClear::MoveSlowAndClear (  ) 
move_slow_and_clear::MoveSlowAndClear::~MoveSlowAndClear (  ) 

Member Function Documentation

void move_slow_and_clear::MoveSlowAndClear::distanceCheck ( const ros::TimerEvent &  e  )  [private]
double move_slow_and_clear::MoveSlowAndClear::getSqDistance (  )  [private]
void move_slow_and_clear::MoveSlowAndClear::initialize ( std::string  n,
tf::TransformListener *  tf,
costmap_2d::Costmap2DROS *  global_costmap,
costmap_2d::Costmap2DROS *  local_costmap 
)

Initialize the parameters of the behavior.

void move_slow_and_clear::MoveSlowAndClear::removeSpeedLimit (  )  [private]
void move_slow_and_clear::MoveSlowAndClear::runBehavior (  ) 

Run the behavior.

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

Member Data Documentation

Definition at line 66 of file move_slow_and_clear.h.

Definition at line 68 of file move_slow_and_clear.h.

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

Definition at line 63 of file move_slow_and_clear.h.

Definition at line 65 of file move_slow_and_clear.h.

Definition at line 72 of file move_slow_and_clear.h.

Definition at line 66 of file move_slow_and_clear.h.

Definition at line 67 of file move_slow_and_clear.h.

Definition at line 67 of file move_slow_and_clear.h.

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

Definition at line 64 of file move_slow_and_clear.h.

Definition at line 71 of file move_slow_and_clear.h.

Definition at line 67 of file move_slow_and_clear.h.

Definition at line 67 of file move_slow_and_clear.h.

Definition at line 62 of file move_slow_and_clear.h.

Definition at line 62 of file move_slow_and_clear.h.

Definition at line 70 of file move_slow_and_clear.h.

Definition at line 69 of file move_slow_and_clear.h.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables


move_slow_and_clear
Author(s): Eitan Marder-Eppstein
autogenerated on Fri Jan 11 09:15:30 2013