#include "ros/ros.h"#include "pluginlib/class_list_macros.h"#include "nodelet/nodelet.h"#include "sensor_msgs/LaserScan.h"#include "pcl/point_cloud.h"#include "pcl_ros/point_cloud.h"#include "pcl/point_types.h"#include "pcl/ros/conversions.h"
Go to the source code of this file.
Classes | |
| class | pcl_to_scan::CloudThrottle | 
Namespaces | |
| namespace | pcl_to_scan | 
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ >  | pcl_to_scan::PointCloud | 
Functions | |
| pcl_to_scan::PLUGINLIB_DECLARE_CLASS (pcl_to_scan, CloudThrottle, pcl_to_scan::CloudThrottle, nodelet::Nodelet) | |