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. | |
| ObstacleAvoidance (int argc, char **argv) | |
| Default contructor. | |
| ~ObstacleAvoidance (void) | |
| Default destructor. | |
| Private Attributes | |
| ros::Publisher | cmd_vel_pub_ | 
| std::string | laser_topic_ | 
| The speeds topic. | |
| ros::NodeHandle | n_ | 
| The laser topic. | |
| sensor_msgs::LaserScan | scan_ | 
| < The ros laser scan msg | |
| std::string | speeds_topic_ | 
| The twist publisher. | |
| ros::Subscriber | subscriber_ | 
| The ROS node handle. | |
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.
| 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.
Definition at line 69 of file obstacle_avoidance.h.
| std::string stdr_samples::ObstacleAvoidance::laser_topic_  [private] | 
The speeds topic.
Definition at line 65 of file obstacle_avoidance.h.
The laser topic.
Definition at line 62 of file obstacle_avoidance.h.
| sensor_msgs::LaserScan stdr_samples::ObstacleAvoidance::scan_  [private] | 
< The ros laser scan msg
Subscriber for the ros laser msg
Definition at line 56 of file obstacle_avoidance.h.
| std::string stdr_samples::ObstacleAvoidance::speeds_topic_  [private] | 
The twist publisher.
Definition at line 68 of file obstacle_avoidance.h.
The ROS node handle.
Definition at line 59 of file obstacle_avoidance.h.