21 #ifndef STDR_OBSTACLE_AVOIDANCE_SAMPLE 22 #define STDR_OBSTACLE_AVOIDANCE_SAMPLE 31 #include <stdr_msgs/RobotIndexedVectorMsg.h> 33 #include <geometry_msgs/Pose2D.h> 34 #include <geometry_msgs/Point.h> 35 #include <geometry_msgs/Twist.h> 36 #include <sensor_msgs/LaserScan.h> 37 #include <sensor_msgs/Range.h> 92 void callback(
const sensor_msgs::LaserScan& msg);
ros::NodeHandle n_
The laser topic.
ros::Publisher cmd_vel_pub_
std::string laser_topic_
The speeds topic.
ros::Subscriber subscriber_
The ROS node handle.
sensor_msgs::LaserScan scan_
< The ros laser scan msg
void callback(const sensor_msgs::LaserScan &msg)
Callback for the ros laser message.
ObstacleAvoidance(int argc, char **argv)
Default contructor.
Performs obstacle avoidance to a single robot.
std::string speeds_topic_
The twist publisher.
~ObstacleAvoidance(void)
Default destructor.
The main namespace for STDR Samples.