Functions
pcl16_ros Namespace Reference

Functions

void transformAsMatrix (const tf::Transform &bt, Eigen::Matrix4f &out_mat)
 Obtain the transformation matrix from TF into an Eigen form.
template<typename PointT >
void transformPointCloud (const pcl16::PointCloud< PointT > &cloud_in, pcl16::PointCloud< PointT > &cloud_out, const tf::Transform &transform)
 Apply a rigid transform defined by a 3D offset and a quaternion.
template<typename PointT >
bool transformPointCloud (const std::string &target_frame, const pcl16::PointCloud< PointT > &cloud_in, pcl16::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener)
 Transforms a point cloud in a given target TF frame using a TransformListener.
bool transformPointCloud (const std::string &target_frame, const sensor_msgs::PointCloud2 &in, sensor_msgs::PointCloud2 &out, const tf::TransformListener &tf_listener)
 Transform a sensor_msgs::PointCloud2 dataset from its frame to a given TF target frame.
void transformPointCloud (const std::string &target_frame, const tf::Transform &net_transform, const sensor_msgs::PointCloud2 &in, sensor_msgs::PointCloud2 &out)
 Transform a sensor_msgs::PointCloud2 dataset from its frame to a given TF target frame.
void transformPointCloud (const Eigen::Matrix4f &transform, const sensor_msgs::PointCloud2 &in, sensor_msgs::PointCloud2 &out)
 Transform a sensor_msgs::PointCloud2 dataset using an Eigen 4x4 matrix.
template<typename PointT >
bool transformPointCloud (const std::string &target_frame, const ros::Time &target_time, const pcl16::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl16::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener)
 Transforms a point cloud in a given target TF frame using a TransformListener.
template<typename PointT >
void transformPointCloudWithNormals (const pcl16::PointCloud< PointT > &cloud_in, pcl16::PointCloud< PointT > &cloud_out, const tf::Transform &transform)
 Transform a point cloud and rotate its normals using an Eigen transform.
template<typename PointT >
bool transformPointCloudWithNormals (const std::string &target_frame, const pcl16::PointCloud< PointT > &cloud_in, pcl16::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener)
 Transforms a point cloud in a given target TF frame using a TransformListener.
template<typename PointT >
bool transformPointCloudWithNormals (const std::string &target_frame, const ros::Time &target_time, const pcl16::PointCloud< PointT > &cloud_in, const std::string &fixed_frame, pcl16::PointCloud< PointT > &cloud_out, const tf::TransformListener &tf_listener)
 Transforms a point cloud in a given target TF frame using a TransformListener.

Function Documentation

void pcl16_ros::transformAsMatrix ( const tf::Transform bt,
Eigen::Matrix4f &  out_mat 
)

Obtain the transformation matrix from TF into an Eigen form.

Parameters:
btthe TF transformation
out_matthe Eigen transformation

Definition at line 211 of file transforms.cpp.

template<typename PointT >
void pcl16_ros::transformPointCloud ( const pcl16::PointCloud< PointT > &  cloud_in,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::Transform transform 
)

Apply a rigid transform defined by a 3D offset and a quaternion.

Parameters:
cloud_inthe input point cloud
cloud_outthe input point cloud
transforma rigid transformation from tf
Note:
calls the Eigen version

Definition at line 67 of file transforms.hpp.

template<typename PointT >
bool pcl16_ros::transformPointCloud ( const std::string &  target_frame,
const pcl16::PointCloud< PointT > &  cloud_in,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::TransformListener tf_listener 
)

Transforms a point cloud in a given target TF frame using a TransformListener.

Parameters:
target_framethe target TF frame the point cloud should be transformed to
cloud_inthe input point cloud
cloud_outthe input point cloud
tf_listenera TF listener object

Definition at line 122 of file transforms.hpp.

bool pcl16_ros::transformPointCloud ( const std::string &  target_frame,
const sensor_msgs::PointCloud2 &  in,
sensor_msgs::PointCloud2 &  out,
const tf::TransformListener tf_listener 
)

Transform a sensor_msgs::PointCloud2 dataset from its frame to a given TF target frame.

Parameters:
target_framethe target TF frame
inthe input PointCloud2 dataset
outthe resultant transformed PointCloud2 dataset
tf_listenera TF listener object

Definition at line 47 of file transforms.cpp.

void pcl16_ros::transformPointCloud ( const std::string &  target_frame,
const tf::Transform net_transform,
const sensor_msgs::PointCloud2 &  in,
sensor_msgs::PointCloud2 &  out 
)

Transform a sensor_msgs::PointCloud2 dataset from its frame to a given TF target frame.

Parameters:
target_framethe target TF frame
net_transformthe TF transformer object
inthe input PointCloud2 dataset
outthe resultant transformed PointCloud2 dataset

Definition at line 85 of file transforms.cpp.

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

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

Parameters:
transformthe transformation to use on the points
inthe input PointCloud2 dataset
outthe resultant transformed PointCloud2 dataset

Definition at line 105 of file transforms.cpp.

template<typename PointT >
bool pcl16_ros::transformPointCloud ( const std::string &  target_frame,
const ros::Time target_time,
const pcl16::PointCloud< PointT > &  cloud_in,
const std::string &  fixed_frame,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::TransformListener tf_listener 
)

Transforms a point cloud in a given target TF frame using a TransformListener.

Parameters:
target_framethe target TF frame the point cloud should be transformed to
target_timethe target timestamp
cloud_inthe input point cloud
fixed_framefixed TF frame
cloud_outthe input point cloud
tf_listenera TF listener object

Definition at line 155 of file transforms.hpp.

template<typename PointT >
void pcl16_ros::transformPointCloudWithNormals ( const pcl16::PointCloud< PointT > &  cloud_in,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::Transform transform 
)

Transform a point cloud and rotate its normals using an Eigen transform.

Parameters:
cloud_inthe input point cloud
cloud_outthe input point cloud
transforma rigid transformation from tf
Note:
calls the Eigen version

Definition at line 46 of file transforms.hpp.

template<typename PointT >
bool pcl16_ros::transformPointCloudWithNormals ( const std::string &  target_frame,
const pcl16::PointCloud< PointT > &  cloud_in,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::TransformListener tf_listener 
)

Transforms a point cloud in a given target TF frame using a TransformListener.

Parameters:
target_framethe target TF frame the point cloud should be transformed to
cloud_inthe input point cloud
cloud_outthe input point cloud
tf_listenera TF listener object

Definition at line 88 of file transforms.hpp.

template<typename PointT >
bool pcl16_ros::transformPointCloudWithNormals ( const std::string &  target_frame,
const ros::Time target_time,
const pcl16::PointCloud< PointT > &  cloud_in,
const std::string &  fixed_frame,
pcl16::PointCloud< PointT > &  cloud_out,
const tf::TransformListener tf_listener 
)

Transforms a point cloud in a given target TF frame using a TransformListener.

Parameters:
target_framethe target TF frame the point cloud should be transformed to
target_timethe target timestamp
cloud_inthe input point cloud
fixed_framefixed TF frame
cloud_outthe input point cloud
tf_listenera TF listener object

Definition at line 186 of file transforms.hpp.



pcl16_ros
Author(s): Maintained by Radu Bogdan Rusu
autogenerated on Thu Jan 2 2014 11:37:07