$search
#include "transform.h"#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.
Namespaces | |
| namespace | velodyne_pointcloud |
This class transforms raw Velodyne 3D LIDAR packets to PointCloud2 in the /odom frame of reference.
Definition in file transform.cc.