
| Public Member Functions | |
| StereoOdometer (const std::string &transport) | |
| ~StereoOdometer () | |
| Protected Member Functions | |
| fovis::StereoDepth * | createStereoDepth (const sensor_msgs::CameraInfoConstPtr &l_info_msg, const sensor_msgs::CameraInfoConstPtr &r_info_msg) const | 
| void | imageCallback (const sensor_msgs::ImageConstPtr &l_image_msg, const sensor_msgs::ImageConstPtr &r_image_msg, const sensor_msgs::CameraInfoConstPtr &l_info_msg, const sensor_msgs::CameraInfoConstPtr &r_info_msg) | 
| Private Attributes | |
| fovis::StereoDepth * | stereo_depth_ | 
Definition at line 17 of file stereo_odometer.cpp.
| fovis_ros::StereoOdometer::StereoOdometer | ( | const std::string & | transport | ) |  [inline] | 
Definition at line 26 of file stereo_odometer.cpp.
| fovis_ros::StereoOdometer::~StereoOdometer | ( | ) |  [inline] | 
Definition at line 32 of file stereo_odometer.cpp.
| fovis::StereoDepth* fovis_ros::StereoOdometer::createStereoDepth | ( | const sensor_msgs::CameraInfoConstPtr & | l_info_msg, | 
| const sensor_msgs::CameraInfoConstPtr & | r_info_msg | ||
| ) | const  [inline, protected] | 
Definition at line 39 of file stereo_odometer.cpp.
| void fovis_ros::StereoOdometer::imageCallback | ( | const sensor_msgs::ImageConstPtr & | l_image_msg, | 
| const sensor_msgs::ImageConstPtr & | r_image_msg, | ||
| const sensor_msgs::CameraInfoConstPtr & | l_info_msg, | ||
| const sensor_msgs::CameraInfoConstPtr & | r_info_msg | ||
| ) |  [inline, protected, virtual] | 
Implement this method in sub-classes
Implements fovis_ros::StereoProcessor.
Definition at line 78 of file stereo_odometer.cpp.
| fovis::StereoDepth* fovis_ros::StereoOdometer::stereo_depth_  [private] | 
Definition at line 22 of file stereo_odometer.cpp.