#include <ros/ros.h>#include "tf/message_filter.h"#include "message_filters/subscriber.h"#include <sensor_msgs/PointCloud2.h>#include <velodyne_pointcloud/rawdata.h>#include <velodyne_pointcloud/point_types.h>#include <pcl_ros/impl/transforms.hpp>

Go to the source code of this file.
Classes | |
| struct | velodyne_pointcloud::Transform::Config |
| configuration parameters More... | |
| class | velodyne_pointcloud::Transform |
Namespaces | |
| namespace | velodyne_pointcloud |
Typedefs | |
| typedef velodyne_rawdata::VPoint | VPoint |
| typedef velodyne_rawdata::VPointCloud | VPointCloud |
This class transforms raw Velodyne 3D LIDAR packets to PointCloud2 in the /odom frame of reference.
Definition in file transform.h.
| typedef velodyne_rawdata::VPoint VPoint |
types of point and cloud to work with
Definition at line 33 of file transform.h.
Definition at line 34 of file transform.h.