conversions.h File Reference

#include <sensor_msgs/PointField.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/image_encodings.h>
#include "pcl/point_cloud.h"
#include "pcl/ros/point_traits.h"
#include "pcl/ros/for_each_type.h"
#include "pcl/exceptions.h"
#include <boost/foreach.hpp>
Include dependency graph for conversions.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  pcl::detail::FieldAdder< PointT >
struct  pcl::detail::FieldMapper< PointT >

Namespaces

namespace  pcl
namespace  pcl::detail

Functions

template<typename PointT >
void pcl::createMapping (const std::vector< sensor_msgs::PointField > &msg_fields, MsgFieldMap &field_map)
bool pcl::detail::fieldOrdering (const FieldMapping &a, const FieldMapping &b)
template<typename PointT >
void pcl::fromROSMsg (const sensor_msgs::PointCloud2 &msg, pcl::PointCloud< PointT > &cloud)
template<typename PointT >
void pcl::fromROSMsg (const sensor_msgs::PointCloud2 &msg, pcl::PointCloud< PointT > &cloud, const MsgFieldMap &field_map)
void pcl::toROSMsg (const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &msg)
 Copy the RGB fields of a PointCloud2 msg into sensor_msgs::Image format.
template<typename CloudT >
void pcl::toROSMsg (const CloudT &cloud, sensor_msgs::Image &msg)
 Copy the RGB fields of a PointCloud into sensor_msgs::Image format.
template<typename PointT >
void pcl::toROSMsg (const pcl::PointCloud< PointT > &cloud, sensor_msgs::PointCloud2 &msg)
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines


pcl
Author(s): See http://pcl.ros.org/authors for the complete list of authors.
autogenerated on Fri Jan 11 09:55:30 2013