#include <string>
#include <ros/ros.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include <sensor_msgs/PointCloud2.h>
#include <velodyne_pointcloud/rawdata.h>
#include <dynamic_reconfigure/server.h>
#include <velodyne_pointcloud/CloudNodeConfig.h>
Go to the source code of this file.
Classes | |
struct | velodyne_pointcloud::Convert::Config |
configuration parameters More... | |
class | velodyne_pointcloud::Convert |
Namespaces | |
velodyne_pointcloud | |
This class converts raw Velodyne 3D LIDAR packets to PointCloud2.
Definition in file convert.h.