|  | 
| template<typename PointT > | 
| void | pcl_ros::transformPointCloud (const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf::Transform &transform) | 
|  | Apply a rigid transform defined by a 3D offset and a quaternion.  More... 
 | 
|  | 
| template<typename PointT > | 
| void | pcl_ros::transformPointCloud (const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const geometry_msgs::Transform &transform) | 
|  | Apply a rigid transform defined by a 3D offset and a quaternion.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloud (const std::string &target_frame, const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloud (const std::string &target_frame, const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf2_ros::Buffer &tf_buffer) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloud (const std::string &target_frame, const ros::Time &target_time, const pcl::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloud (const std::string &target_frame, const ros::Time &target_time, const pcl::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl::PointCloud< PointT > &cloud_out, const tf2_ros::Buffer &tf_buffer) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| void | pcl_ros::transformPointCloudWithNormals (const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf::Transform &transform) | 
|  | Transform a point cloud and rotate its normals using an Eigen transform.  More... 
 | 
|  | 
| template<typename PointT > | 
| void | pcl_ros::transformPointCloudWithNormals (const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const geometry_msgs::Transform &transform) | 
|  | Transform a point cloud and rotate its normals using an Eigen transform.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloudWithNormals (const std::string &target_frame, const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloudWithNormals (const std::string &target_frame, const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, const tf2_ros::Buffer &tf_buffer) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloudWithNormals (const std::string &target_frame, const ros::Time &target_time, const pcl::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  | 
| template<typename PointT > | 
| bool | pcl_ros::transformPointCloudWithNormals (const std::string &target_frame, const ros::Time &target_time, const pcl::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl::PointCloud< PointT > &cloud_out, const tf2_ros::Buffer &tf_buffer) | 
|  | Transforms a point cloud in a given target TF frame using a TransformListener.  More... 
 | 
|  |