#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 "eddiebot_follower/FollowerConfig.h"
Go to the source code of this file.
Classes | |
class | eddiebot_follower::EddiebotFollower |
Namespaces | |
namespace | eddiebot_follower |
Typedefs | |
typedef pcl::PointCloud < pcl::PointXYZ > | eddiebot_follower::PointCloud |
Functions | |
eddiebot_follower::PLUGINLIB_DECLARE_CLASS (eddiebot_follower, EddiebotFollower, eddiebot_follower::EddiebotFollower, nodelet::Nodelet) |