#include <ros/ros.h>
#include <pcl/point_cloud.h>
#include <pcl/pcl_config.h>
#include <pcl/point_traits.h>
#include <pcl/for_each_type.h>
#include <pcl/conversions.h>
#include <pcl_conversions/pcl_conversions.h>
#include <sensor_msgs/PointCloud2.h>
#include <boost/foreach.hpp>
#include <boost/mpl/size.hpp>
#include <boost/ref.hpp>
#include <boost/thread/mutex.hpp>
Go to the source code of this file.
Namespaces | |
pcl | |
pcl::detail | |
ros | |
ros::serialization | |
Macros | |
#define | ROS_POINTER_COMPATIBILITY_IMPLEMENTED 0 |
Functions | |
template<class T > | |
boost::shared_ptr< T > | pcl::pcl_ptr (const boost::shared_ptr< T > &p) |
template<class T > | |
boost::shared_ptr< T > | pcl::ros_ptr (const boost::shared_ptr< T > &p) |
#define ROS_POINTER_COMPATIBILITY_IMPLEMENTED 0 |
Definition at line 283 of file point_cloud.h.