Namespaces | Functions
point_cloud.cpp File Reference
#include "pointmatcher_ros/point_cloud.h"
#include "ros/ros.h"
#include "boost/detail/endian.hpp"
#include "tf/transform_listener.h"
#include <vector>
#include <memory>
Include dependency graph for point_cloud.cpp:

Go to the source code of this file.

Namespaces

namespace  PointMatcher_ros

Functions

template<typename T >
sensor_msgs::PointCloud2 PointMatcher_ros::pointMatcherCloudToRosMsg (const typename PointMatcher< T >::DataPoints &pmCloud, const std::string &frame_id, const ros::Time &stamp)
template sensor_msgs::PointCloud2 PointMatcher_ros::pointMatcherCloudToRosMsg< double > (const PointMatcher< double >::DataPoints &pmCloud, const std::string &frame_id, const ros::Time &stamp)
template sensor_msgs::PointCloud2 PointMatcher_ros::pointMatcherCloudToRosMsg< float > (const PointMatcher< float >::DataPoints &pmCloud, const std::string &frame_id, const ros::Time &stamp)
template<typename T >
PointMatcher< T >::DataPoints PointMatcher_ros::rosMsgToPointMatcherCloud (const sensor_msgs::PointCloud2 &rosMsg)
 Transform a ROS PointCloud2 message into a libpointmatcher point cloud.
template<typename T >
PointMatcher< T >::DataPoints PointMatcher_ros::rosMsgToPointMatcherCloud (const sensor_msgs::LaserScan &rosMsg, const tf::TransformListener *listener=0, const std::string &fixed_frame="/world", const bool force3D=false, const bool addTimestamps=false)
template PointMatcher< double >
::DataPoints 
PointMatcher_ros::rosMsgToPointMatcherCloud< double > (const sensor_msgs::PointCloud2 &rosMsg)
template PointMatcher< double >
::DataPoints 
PointMatcher_ros::rosMsgToPointMatcherCloud< double > (const sensor_msgs::LaserScan &rosMsg, const tf::TransformListener *listener, const std::string &fixedFrame, const bool force3D, const bool addTimestamps)
template PointMatcher< float >
::DataPoints 
PointMatcher_ros::rosMsgToPointMatcherCloud< float > (const sensor_msgs::PointCloud2 &rosMsg)
template PointMatcher< float >
::DataPoints 
PointMatcher_ros::rosMsgToPointMatcherCloud< float > (const sensor_msgs::LaserScan &rosMsg, const tf::TransformListener *listener, const std::string &fixedFrame, const bool force3D, const bool addTimestamps)


libpointmatcher_ros
Author(s): Stéphane Magnenat, Francois Pomerleau
autogenerated on Tue Mar 3 2015 15:28:40