#include <ros/ros.h>
#include <mcl_3dl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl_ros/point_cloud.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud_conversion.h>
Go to the source code of this file.
Namespaces | |
mcl_3dl | |
Functions | |
template<typename PointT > | |
bool | mcl_3dl::fromROSMsg (const sensor_msgs::PointCloud2 &msg, pcl::PointCloud< PointT > &pc) |