
| Public Member Functions | |
| MonoDepthOdometer (const std::string &transport) | |
| ~MonoDepthOdometer () | |
| Protected Member Functions | |
| fovis::DepthImage * | createDepthSource (const sensor_msgs::CameraInfoConstPtr &image_info_msg, const sensor_msgs::CameraInfoConstPtr &depth_info_msg) const | 
| void | imageCallback (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::CameraInfoConstPtr &image_info_msg, const sensor_msgs::CameraInfoConstPtr &depth_info_msg) | 
| Private Attributes | |
| fovis::DepthImage * | depth_image_ | 
Definition at line 17 of file mono_depth_odometer.cpp.
| fovis_ros::MonoDepthOdometer::MonoDepthOdometer | ( | const std::string & | transport | ) |  [inline] | 
Definition at line 26 of file mono_depth_odometer.cpp.
| fovis_ros::MonoDepthOdometer::~MonoDepthOdometer | ( | ) |  [inline] | 
Definition at line 32 of file mono_depth_odometer.cpp.
| fovis::DepthImage* fovis_ros::MonoDepthOdometer::createDepthSource | ( | const sensor_msgs::CameraInfoConstPtr & | image_info_msg, | 
| const sensor_msgs::CameraInfoConstPtr & | depth_info_msg | ||
| ) | const  [inline, protected] | 
Definition at line 39 of file mono_depth_odometer.cpp.
| void fovis_ros::MonoDepthOdometer::imageCallback | ( | const sensor_msgs::ImageConstPtr & | image_msg, | 
| const sensor_msgs::ImageConstPtr & | depth_msg, | ||
| const sensor_msgs::CameraInfoConstPtr & | image_info_msg, | ||
| const sensor_msgs::CameraInfoConstPtr & | depth_info_msg | ||
| ) |  [inline, protected, virtual] | 
Implement this method in sub-classes
Implements fovis_ros::MonoDepthProcessor.
Definition at line 55 of file mono_depth_odometer.cpp.
| fovis::DepthImage* fovis_ros::MonoDepthOdometer::depth_image_  [private] | 
Definition at line 22 of file mono_depth_odometer.cpp.