Namespaces | Functions
transforms.h File Reference
#include <sensor_msgs/PointCloud2.h>
#include <pcl16/common/transforms.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
Include dependency graph for transforms.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  pcl16_ros

Functions

void pcl16_ros::transformAsMatrix (const tf::Transform &bt, Eigen::Matrix4f &out_mat)
 Obtain the transformation matrix from TF into an Eigen form.
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.
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.
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.
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.
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.
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.
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.
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.
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.


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