Public Member Functions | Private Attributes | List of all members
stdr_samples::ObstacleAvoidance Class Reference

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...
 

Detailed Description

Performs obstacle avoidance to a single robot.

Definition at line 49 of file obstacle_avoidance.h.

Constructor & Destructor Documentation

stdr_samples::ObstacleAvoidance::ObstacleAvoidance ( int  argc,
char **  argv 
)

Default contructor.

Parameters
argc[int] Number of input arguments
argv[char **] Input arguments
Returns
void

Definition at line 35 of file obstacle_avoidance.cpp.

stdr_samples::ObstacleAvoidance::~ObstacleAvoidance ( void  )

Default destructor.

Returns
void

Definition at line 61 of file obstacle_avoidance.cpp.

Member Function Documentation

void stdr_samples::ObstacleAvoidance::callback ( const sensor_msgs::LaserScan &  msg)

Callback for the ros laser message.

Parameters
msg[const sensor_msgs::LaserScan&] The new laser scan message
Returns
void

Definition at line 71 of file obstacle_avoidance.cpp.

Member Data Documentation

ros::Publisher stdr_samples::ObstacleAvoidance::cmd_vel_pub_
private

Definition at line 69 of file obstacle_avoidance.h.

std::string stdr_samples::ObstacleAvoidance::laser_topic_
private

The speeds topic.

Definition at line 63 of file obstacle_avoidance.h.

ros::NodeHandle stdr_samples::ObstacleAvoidance::n_
private

The laser topic.

Definition at line 60 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 54 of file obstacle_avoidance.h.

std::string stdr_samples::ObstacleAvoidance::speeds_topic_
private

The twist publisher.

Definition at line 66 of file obstacle_avoidance.h.

ros::Subscriber stdr_samples::ObstacleAvoidance::subscriber_
private

The ROS node handle.

Definition at line 57 of file obstacle_avoidance.h.


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


stdr_samples
Author(s): Manos Tsardoulias, Chris Zalidis, Aris Thallas
autogenerated on Mon Jun 10 2019 15:15:03