|  | 
| bool | concatenatePointCloud (const sensor_msgs::PointCloud2 &cloud1, const sensor_msgs::PointCloud2 &cloud2, sensor_msgs::PointCloud2 &cloud_out) | 
|  | 
| void | createMapping (const std::vector< sensor_msgs::PointField > &msg_fields, MsgFieldMap &field_map) | 
|  | 
| void | fromROSMsg (const sensor_msgs::PointCloud2 &cloud, pcl::PointCloud< T > &pcl_cloud) | 
|  | 
| int | getFieldIndex (const sensor_msgs::PointCloud2 &cloud, const std::string &field_name) | 
|  | 
| std::string | getFieldsList (const sensor_msgs::PointCloud2 &cloud) | 
|  | 
| void | moveFromROSMsg (sensor_msgs::PointCloud2 &cloud, pcl::PointCloud< T > &pcl_cloud) | 
|  | 
| void | moveToROSMsg (sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image) | 
|  | 
| template<class T > | 
| boost::shared_ptr< T > | pcl_ptr (const boost::shared_ptr< T > &p) | 
|  | 
| template<class T > | 
| boost::shared_ptr< T > | ros_ptr (const boost::shared_ptr< T > &p) | 
|  | 
| void | toROSMsg (const pcl::PointCloud< T > &cloud, sensor_msgs::Image &msg) | 
|  | 
| void | toROSMsg (const pcl::PointCloud< T > &pcl_cloud, sensor_msgs::PointCloud2 &cloud) | 
|  | 
| void | toROSMsg (const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image) | 
|  |