#include <pointcloud_to_laserscan/pointcloud_to_laserscan_nodelet.h>
#include <sensor_msgs/LaserScan.h>
#include <pluginlib/class_list_macros.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <tf2_sensor_msgs/tf2_sensor_msgs.h>
Go to the source code of this file.
Namespaces | |
namespace | pointcloud_to_laserscan |
Functions | |
PLUGINLIB_DECLARE_CLASS (pointcloud_to_laserscan, PointCloudToLaserScanNodelet, pointcloud_to_laserscan::PointCloudToLaserScanNodelet, nodelet::Nodelet) |
PLUGINLIB_DECLARE_CLASS | ( | pointcloud_to_laserscan | , |
PointCloudToLaserScanNodelet | , | ||
pointcloud_to_laserscan::PointCloudToLaserScanNodelet | , | ||
nodelet::Nodelet | |||
) |