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

List of all members.

Public Member Functions

 PointCloudToDepthImage ()
virtual ~PointCloudToDepthImage ()

Private Types

typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::PointCloud2,
sensor_msgs::CameraInfo > 
MyApproxSyncPolicy
typedef
message_filters::sync_policies::ExactTime
< sensor_msgs::PointCloud2,
sensor_msgs::CameraInfo > 
MyExactSyncPolicy

Private Member Functions

void callback (const sensor_msgs::PointCloud2ConstPtr &pointCloud2Msg, const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg)
virtual void onInit ()

Private Attributes

message_filters::Synchronizer
< MyApproxSyncPolicy > * 
approxSync_
message_filters::Subscriber
< sensor_msgs::CameraInfo > 
cameraInfoSub_
int decimation_
image_transport::Publisher depthImage16Pub_
image_transport::Publisher depthImage32Pub_
message_filters::Synchronizer
< MyExactSyncPolicy > * 
exactSync_
double fillHolesError_
int fillHolesSize_
int fillIterations_
std::string fixedFrameId_
tf::TransformListenerlistener_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
pointCloudSub_
double waitForTransform_

Detailed Description

Definition at line 57 of file pointcloud_to_depthimage.cpp.


Member Typedef Documentation

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::PointCloud2, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudToDepthImage::MyApproxSyncPolicy [private]

Definition at line 240 of file pointcloud_to_depthimage.cpp.

typedef message_filters::sync_policies::ExactTime<sensor_msgs::PointCloud2, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudToDepthImage::MyExactSyncPolicy [private]

Definition at line 242 of file pointcloud_to_depthimage.cpp.


Constructor & Destructor Documentation

Definition at line 60 of file pointcloud_to_depthimage.cpp.

Definition at line 71 of file pointcloud_to_depthimage.cpp.


Member Function Documentation

void rtabmap_ros::PointCloudToDepthImage::callback ( const sensor_msgs::PointCloud2ConstPtr &  pointCloud2Msg,
const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg 
) [inline, private]

Definition at line 141 of file pointcloud_to_depthimage.cpp.

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

Implements nodelet::Nodelet.

Definition at line 85 of file pointcloud_to_depthimage.cpp.


Member Data Documentation

Definition at line 241 of file pointcloud_to_depthimage.cpp.

Definition at line 231 of file pointcloud_to_depthimage.cpp.

Definition at line 238 of file pointcloud_to_depthimage.cpp.

Definition at line 228 of file pointcloud_to_depthimage.cpp.

Definition at line 229 of file pointcloud_to_depthimage.cpp.

Definition at line 243 of file pointcloud_to_depthimage.cpp.

Definition at line 236 of file pointcloud_to_depthimage.cpp.

Definition at line 235 of file pointcloud_to_depthimage.cpp.

Definition at line 237 of file pointcloud_to_depthimage.cpp.

Definition at line 232 of file pointcloud_to_depthimage.cpp.

Definition at line 233 of file pointcloud_to_depthimage.cpp.

Definition at line 230 of file pointcloud_to_depthimage.cpp.

Definition at line 234 of file pointcloud_to_depthimage.cpp.


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


rtabmap_ros
Author(s): Mathieu Labbe
autogenerated on Thu Jun 6 2019 21:30:50