$search

PointCloudConverter Class Reference

List of all members.

Public Member Functions

void cloud_cb_points (const sensor_msgs::PointCloudConstPtr &msg)
 Old format callback.
void cloud_cb_points2 (const sensor_msgs::PointCloud2ConstPtr &msg)
 New format callback.
std::string getFieldsList (const sensor_msgs::PointCloud &points)
 Get the available point cloud channels as a space separated string.
std::string getFieldsList (const sensor_msgs::PointCloud2 &cloud)
 Get the available point cloud fields as a space separated string.
 PointCloudConverter ()

Private Attributes

boost::mutex m_mutex_
ros::NodeHandle nh_
string points2_in_
string points2_out_
string points_in_
string points_out_
ros::Publisher pub_points2_
ros::Publisher pub_points_
int queue_size_
ros::Subscriber sub_points2_
ros::Subscriber sub_points_

Detailed Description

Definition at line 54 of file converter.cpp.


Constructor & Destructor Documentation

PointCloudConverter::PointCloudConverter (  )  [inline]

Definition at line 68 of file converter.cpp.


Member Function Documentation

void PointCloudConverter::cloud_cb_points ( const sensor_msgs::PointCloudConstPtr msg  )  [inline]

Old format callback.

Definition at line 135 of file converter.cpp.

void PointCloudConverter::cloud_cb_points2 ( const sensor_msgs::PointCloud2ConstPtr msg  )  [inline]

New format callback.

Definition at line 111 of file converter.cpp.

std::string PointCloudConverter::getFieldsList ( const sensor_msgs::PointCloud points  )  [inline]

Get the available point cloud channels as a space separated string.

Parameters:
points a pointer to the PointCloud message

Definition at line 100 of file converter.cpp.

std::string PointCloudConverter::getFieldsList ( const sensor_msgs::PointCloud2 cloud  )  [inline]

Get the available point cloud fields as a space separated string.

Parameters:
points a pointer to the PointCloud message

Definition at line 86 of file converter.cpp.


Member Data Documentation

boost::mutex PointCloudConverter::m_mutex_ [private]

Definition at line 57 of file converter.cpp.

Definition at line 59 of file converter.cpp.

Definition at line 64 of file converter.cpp.

Definition at line 64 of file converter.cpp.

Definition at line 64 of file converter.cpp.

Definition at line 64 of file converter.cpp.

Definition at line 61 of file converter.cpp.

Definition at line 61 of file converter.cpp.

Definition at line 63 of file converter.cpp.

Definition at line 60 of file converter.cpp.

Definition at line 60 of file converter.cpp.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


point_cloud_converter
Author(s): Radu Bogdan Rusu
autogenerated on Fri Mar 1 16:37:45 2013