#include <tf2/convert.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <Eigen/Eigen>
#include <Eigen/Geometry>
Go to the source code of this file.
|  | 
| template<> | 
| void | tf2::doTransform (const sensor_msgs::PointCloud2 &p_in, sensor_msgs::PointCloud2 &p_out, const geometry_msgs::TransformStamped &t_in) | 
|  | 
| void | tf2::fromMsg (const sensor_msgs::PointCloud2 &msg, sensor_msgs::PointCloud2 &out) | 
|  | 
| template<> | 
| const std::string & | tf2::getFrameId (const sensor_msgs::PointCloud2 &p) | 
|  | Extract a frame ID from the header of a PointCloud2 message. This function is a specialization of the getFrameId template defined in tf2/convert.h.  More... 
 | 
|  | 
| template<> | 
| const ros::Time & | tf2::getTimestamp (const sensor_msgs::PointCloud2 &p) | 
|  | Extract a timestamp from the header of a PointCloud2 message. This function is a specialization of the getTimestamp template defined in tf2/convert.h.  More... 
 | 
|  | 
| sensor_msgs::PointCloud2 | tf2::toMsg (const sensor_msgs::PointCloud2 &in) | 
|  |