#include <ros/ros.h>#include <geometry_msgs/Point32.h>#include <nodelet/nodelet.h>#include <pluginlib/class_list_macros.h>#include <sensor_msgs/PointCloud.h>#include <tf/transform_listener.h>#include <velodyne/ring_sequence.h>#include <velodyne/data_xyz.h>

Go to the source code of this file.
Classes | |
| struct | TransformNodelet::Config |
| configuration parameters More... | |
| class | TransformNodelet |
Functions | |
| PLUGINLIB_DECLARE_CLASS (velodyne_common, TransformNodelet, TransformNodelet, nodelet::Nodelet) | |
This ROS nodelet transforms raw Velodyne HDL-64E 3D LIDAR data to a PointCloud in some frame of reference, typically "/odom".
Definition in file transform_nodelet.cc.
| PLUGINLIB_DECLARE_CLASS | ( | velodyne_common | , | |
| TransformNodelet | , | |||
| TransformNodelet | , | |||
| nodelet::Nodelet | ||||
| ) |