#include <string>
#include <ros/ros.h>
#include "tf/message_filter.h"
#include "message_filters/subscriber.h"
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include <sensor_msgs/PointCloud2.h>
#include <velodyne_pointcloud/rawdata.h>
#include <velodyne_pointcloud/pointcloudXYZIR.h>
#include <dynamic_reconfigure/server.h>
#include <velodyne_pointcloud/TransformNodeConfig.h>
Go to the source code of this file.
Classes | |
struct | velodyne_pointcloud::Transform::Config |
configuration parameters More... | |
class | velodyne_pointcloud::Transform |
Namespaces | |
velodyne_pointcloud | |
Typedefs | |
using | velodyne_pointcloud::TransformNodeCfg = velodyne_pointcloud::TransformNodeConfig |
This class transforms raw Velodyne 3D LIDAR packets to PointCloud2 in the /map frame of reference.
Definition in file transform.h.