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

List of all members.

Public Member Functions

 RGBDOdometry ()
virtual ~RGBDOdometry ()

Protected Member Functions

virtual void flushCallbacks ()

Private Types

typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::Image,
sensor_msgs::Image,
sensor_msgs::CameraInfo > 
MyApproxSyncPolicy
typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::Image,
sensor_msgs::Image,
sensor_msgs::CameraInfo > 
MyExactSyncPolicy
typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::Image,
sensor_msgs::Image,
sensor_msgs::CameraInfo,
sensor_msgs::Image,
sensor_msgs::Image,
sensor_msgs::CameraInfo > 
MySync2Policy

Private Member Functions

void callback (const sensor_msgs::ImageConstPtr &image, const sensor_msgs::ImageConstPtr &depth, const sensor_msgs::CameraInfoConstPtr &cameraInfo)
void callback2 (const sensor_msgs::ImageConstPtr &image, const sensor_msgs::ImageConstPtr &depth, const sensor_msgs::CameraInfoConstPtr &cameraInfo, const sensor_msgs::ImageConstPtr &image2, const sensor_msgs::ImageConstPtr &depth2, const sensor_msgs::CameraInfoConstPtr &cameraInfo2)
virtual void onOdomInit ()

Private Attributes

message_filters::Synchronizer
< MyApproxSyncPolicy > * 
approxSync_
message_filters::Synchronizer
< MyExactSyncPolicy > * 
exactSync_
image_transport::SubscriberFilter image_depth2_sub_
image_transport::SubscriberFilter image_depth_sub_
image_transport::SubscriberFilter image_mono2_sub_
image_transport::SubscriberFilter image_mono_sub_
message_filters::Subscriber
< sensor_msgs::CameraInfo > 
info2_sub_
message_filters::Subscriber
< sensor_msgs::CameraInfo > 
info_sub_
int queueSize_
message_filters::Synchronizer
< MySync2Policy > * 
sync2_

Detailed Description

Definition at line 58 of file rgbd_odometry.cpp.


Member Typedef Documentation

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> rtabmap_ros::RGBDOdometry::MyApproxSyncPolicy [private]

Definition at line 408 of file rgbd_odometry.cpp.

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> rtabmap_ros::RGBDOdometry::MyExactSyncPolicy [private]

Definition at line 410 of file rgbd_odometry.cpp.

typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo, sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> rtabmap_ros::RGBDOdometry::MySync2Policy [private]

Definition at line 412 of file rgbd_odometry.cpp.


Constructor & Destructor Documentation

Definition at line 61 of file rgbd_odometry.cpp.

virtual rtabmap_ros::RGBDOdometry::~RGBDOdometry ( ) [inline, virtual]

Definition at line 70 of file rgbd_odometry.cpp.


Member Function Documentation

void rtabmap_ros::RGBDOdometry::callback ( const sensor_msgs::ImageConstPtr &  image,
const sensor_msgs::ImageConstPtr &  depth,
const sensor_msgs::CameraInfoConstPtr &  cameraInfo 
) [inline, private]

Definition at line 189 of file rgbd_odometry.cpp.

void rtabmap_ros::RGBDOdometry::callback2 ( const sensor_msgs::ImageConstPtr &  image,
const sensor_msgs::ImageConstPtr &  depth,
const sensor_msgs::CameraInfoConstPtr &  cameraInfo,
const sensor_msgs::ImageConstPtr &  image2,
const sensor_msgs::ImageConstPtr &  depth2,
const sensor_msgs::CameraInfoConstPtr &  cameraInfo2 
) [inline, private]

Definition at line 237 of file rgbd_odometry.cpp.

virtual void rtabmap_ros::RGBDOdometry::flushCallbacks ( ) [inline, protected, virtual]

Implements rtabmap_ros::OdometryROS.

Definition at line 371 of file rgbd_odometry.cpp.

virtual void rtabmap_ros::RGBDOdometry::onOdomInit ( ) [inline, private, virtual]

Implements rtabmap_ros::OdometryROS.

Definition at line 88 of file rgbd_odometry.cpp.


Member Data Documentation

Definition at line 409 of file rgbd_odometry.cpp.

Definition at line 411 of file rgbd_odometry.cpp.

Definition at line 406 of file rgbd_odometry.cpp.

Definition at line 403 of file rgbd_odometry.cpp.

Definition at line 405 of file rgbd_odometry.cpp.

Definition at line 402 of file rgbd_odometry.cpp.

Definition at line 407 of file rgbd_odometry.cpp.

Definition at line 404 of file rgbd_odometry.cpp.

Definition at line 414 of file rgbd_odometry.cpp.

Definition at line 413 of file rgbd_odometry.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