Performs obstacle avoidance to a single robot. More...
#include <obstacle_avoidance.h>
| Public Member Functions | |
| void | callback (const sensor_msgs::LaserScan &msg) | 
| Callback for the ros laser message.  More... | |
| ObstacleAvoidance (int argc, char **argv) | |
| Default contructor.  More... | |
| ~ObstacleAvoidance (void) | |
| Default destructor.  More... | |
| Private Attributes | |
| ros::Publisher | cmd_vel_pub_ | 
| std::string | laser_topic_ | 
| The speeds topic.  More... | |
| ros::NodeHandle | n_ | 
| The laser topic.  More... | |
| sensor_msgs::LaserScan | scan_ | 
| < The ros laser scan msg  More... | |
| std::string | speeds_topic_ | 
| The twist publisher.  More... | |
| ros::Subscriber | subscriber_ | 
| The ROS node handle.  More... | |
Performs obstacle avoidance to a single robot.
Definition at line 49 of file obstacle_avoidance.h.
| stdr_samples::ObstacleAvoidance::ObstacleAvoidance | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Default contructor.
| argc | [int] Number of input arguments | 
| argv | [char **] Input arguments | 
Definition at line 35 of file obstacle_avoidance.cpp.
| stdr_samples::ObstacleAvoidance::~ObstacleAvoidance | ( | void | ) | 
| void stdr_samples::ObstacleAvoidance::callback | ( | const sensor_msgs::LaserScan & | msg | ) | 
Callback for the ros laser message.
| msg | [const sensor_msgs::LaserScan&] The new laser scan message | 
Definition at line 71 of file obstacle_avoidance.cpp.
| 
 | private | 
Definition at line 69 of file obstacle_avoidance.h.
| 
 | private | 
The speeds topic.
Definition at line 63 of file obstacle_avoidance.h.
| 
 | private | 
The laser topic.
Definition at line 60 of file obstacle_avoidance.h.
| 
 | private | 
< The ros laser scan msg
Subscriber for the ros laser msg
Definition at line 54 of file obstacle_avoidance.h.
| 
 | private | 
The twist publisher.
Definition at line 66 of file obstacle_avoidance.h.
| 
 | private | 
The ROS node handle.
Definition at line 57 of file obstacle_avoidance.h.