Function pcl_ros::transformPointCloud(const Eigen::Matrix4f&, const sensor_msgs::msg::PointCloud2&, sensor_msgs::msg::PointCloud2&)

Function Documentation

void pcl_ros::transformPointCloud(const Eigen::Matrix4f &transform, const sensor_msgs::msg::PointCloud2 &in, sensor_msgs::msg::PointCloud2 &out)

Transform a sensor_msgs::PointCloud2 dataset using an Eigen 4x4 matrix.

Parameters:
  • transform – the transformation to use on the points

  • in – the input PointCloud2 dataset

  • out – the resultant transformed PointCloud2 dataset