Namespaces | Functions
pcl Namespace Reference

Namespaces

 detail
 
 io
 

Functions

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)
 

Function Documentation

◆ pcl_ptr()

template<class T >
boost::shared_ptr<T> pcl::pcl_ptr ( const boost::shared_ptr< T > &  p)
inline

Definition at line 392 of file point_cloud.h.

◆ ros_ptr()

template<class T >
boost::shared_ptr<T> pcl::ros_ptr ( const boost::shared_ptr< T > &  p)
inline

Definition at line 354 of file point_cloud.h.



pcl_ros
Author(s): Open Perception, Julius Kammerl , William Woodall
autogenerated on Sat Feb 18 2023 03:54:54