Template Function pcl_ros::transformPointCloud(const std::string&, const pcl::PointCloud<PointT>&, pcl::PointCloud<PointT>&, const tf2_ros::Buffer&)
Defined in File transforms.hpp
Function Documentation
-
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.
- Parameters:
target_frame – the target TF frame the point cloud should be transformed to
cloud_in – the input point cloud
cloud_out – the input point cloud
tf_buffer – a TF buffer object