Public Member Functions | Private Types | Private Member Functions | Private Attributes
rtabmap_ros::PointCloudAggregator Class Reference
Inheritance diagram for rtabmap_ros::PointCloudAggregator:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 PointCloudAggregator ()
virtual ~PointCloudAggregator ()

Private Types

typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::PointCloud2,
sensor_msgs::PointCloud2,
sensor_msgs::PointCloud2 > 
MySyncPolicy

Private Member Functions

void clouds_callback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg_1, const sensor_msgs::PointCloud2ConstPtr &cloudMsg_2, const sensor_msgs::PointCloud2ConstPtr &cloudMsg_3)
virtual void onInit ()

Private Attributes

pcl::PointCloud< pcl::PointXYZ > cloud1
pcl::PointCloud< pcl::PointXYZ > cloud2
pcl::PointCloud< pcl::PointXYZ > cloud3
ros::Publisher cloudPub_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
cloudSub_1_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
cloudSub_2_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
cloudSub_3_
message_filters::Synchronizer
< MySyncPolicy > * 
sync

Detailed Description

Definition at line 26 of file point_cloud_aggregator.cpp.


Member Typedef Documentation

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::PointCloud2, sensor_msgs::PointCloud2, sensor_msgs::PointCloud2> rtabmap_ros::PointCloudAggregator::MySyncPolicy [private]

Definition at line 58 of file point_cloud_aggregator.cpp.


Constructor & Destructor Documentation

Definition at line 29 of file point_cloud_aggregator.cpp.

Definition at line 32 of file point_cloud_aggregator.cpp.


Member Function Documentation

void rtabmap_ros::PointCloudAggregator::clouds_callback ( const sensor_msgs::PointCloud2ConstPtr &  cloudMsg_1,
const sensor_msgs::PointCloud2ConstPtr &  cloudMsg_2,
const sensor_msgs::PointCloud2ConstPtr &  cloudMsg_3 
) [inline, private]

Definition at line 38 of file point_cloud_aggregator.cpp.

virtual void rtabmap_ros::PointCloudAggregator::onInit ( ) [inline, private, virtual]

Implements nodelet::Nodelet.

Definition at line 59 of file point_cloud_aggregator.cpp.


Member Data Documentation

Definition at line 81 of file point_cloud_aggregator.cpp.

Definition at line 81 of file point_cloud_aggregator.cpp.

Definition at line 81 of file point_cloud_aggregator.cpp.

Definition at line 83 of file point_cloud_aggregator.cpp.

Definition at line 78 of file point_cloud_aggregator.cpp.

Definition at line 79 of file point_cloud_aggregator.cpp.

Definition at line 80 of file point_cloud_aggregator.cpp.

Definition at line 77 of file point_cloud_aggregator.cpp.


The documentation for this class was generated from the following file:


rtabmap_ros
Author(s): Mathieu Labbe
autogenerated on Sun Jul 24 2016 03:49:08