#include "ros/ros.h"#include "pluginlib/class_list_macros.h"#include "nodelet/nodelet.h"#include <geometry_msgs/Twist.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include "dynamic_reconfigure/server.h"#include "turtlebot_follower/FollowerConfig.h"
Go to the source code of this file.
Classes | |
| class | turtlebot_follower::TurtlebotFollower | 
Namespaces | |
| namespace | turtlebot_follower | 
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ >  | turtlebot_follower::PointCloud | 
Functions | |
| turtlebot_follower::PLUGINLIB_DECLARE_CLASS (turtlebot_follower, TurtlebotFollower, turtlebot_follower::TurtlebotFollower, nodelet::Nodelet) | |