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

List of all members.

Public Types

typedef pcl::PointCloud
< pcl::PointXYZRGB > 
PointCloud

Public Member Functions

 StereoOdometer (const std::string &transport)

Protected Member Functions

void computeAndPublishPointCloud (const sensor_msgs::CameraInfoConstPtr &l_info_msg, const sensor_msgs::ImageConstPtr &l_image_msg, const sensor_msgs::CameraInfoConstPtr &r_info_msg, const std::vector< Matcher::p_match > &matches, const std::vector< int32_t > &inlier_indices)
double computeFeatureFlow (const std::vector< Matcher::p_match > &matches)
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)
void initOdometer (const sensor_msgs::CameraInfoConstPtr &l_info_msg, const sensor_msgs::CameraInfoConstPtr &r_info_msg)

Private Attributes

bool got_lost_
ros::Publisher info_pub_
bool keep_reference_frame_
ros::Publisher point_cloud_pub_
int ref_frame_change_method_
int ref_frame_inlier_threshold_
double ref_frame_motion_threshold_
Matrix reference_motion_
boost::shared_ptr
< VisualOdometryStereo
visual_odometer_
VisualOdometryStereo::parameters visual_odometer_params_

Detailed Description

Definition at line 46 of file stereo_odometer.cpp.


Member Typedef Documentation

typedef pcl::PointCloud<pcl::PointXYZRGB> viso2_ros::StereoOdometer::PointCloud

Definition at line 68 of file stereo_odometer.cpp.


Constructor & Destructor Documentation

viso2_ros::StereoOdometer::StereoOdometer ( const std::string &  transport) [inline]

Definition at line 70 of file stereo_odometer.cpp.


Member Function Documentation

void viso2_ros::StereoOdometer::computeAndPublishPointCloud ( const sensor_msgs::CameraInfoConstPtr &  l_info_msg,
const sensor_msgs::ImageConstPtr &  l_image_msg,
const sensor_msgs::CameraInfoConstPtr &  r_info_msg,
const std::vector< Matcher::p_match > &  matches,
const std::vector< int32_t > &  inlier_indices 
) [inline, protected]

Definition at line 273 of file stereo_odometer.cpp.

double viso2_ros::StereoOdometer::computeFeatureFlow ( const std::vector< Matcher::p_match > &  matches) [inline, protected]

Definition at line 260 of file stereo_odometer.cpp.

void viso2_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 viso2_ros::StereoProcessor.

Definition at line 113 of file stereo_odometer.cpp.

void viso2_ros::StereoOdometer::initOdometer ( const sensor_msgs::CameraInfoConstPtr &  l_info_msg,
const sensor_msgs::CameraInfoConstPtr &  r_info_msg 
) [inline, protected]

Definition at line 90 of file stereo_odometer.cpp.


Member Data Documentation

Definition at line 57 of file stereo_odometer.cpp.

ros::Publisher viso2_ros::StereoOdometer::info_pub_ [private]

Definition at line 55 of file stereo_odometer.cpp.

Definition at line 61 of file stereo_odometer.cpp.

Definition at line 54 of file stereo_odometer.cpp.

Definition at line 60 of file stereo_odometer.cpp.

Definition at line 63 of file stereo_odometer.cpp.

Definition at line 62 of file stereo_odometer.cpp.

Definition at line 64 of file stereo_odometer.cpp.

Definition at line 51 of file stereo_odometer.cpp.

Definition at line 52 of file stereo_odometer.cpp.


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


viso2_ros
Author(s): Stephan Wirth
autogenerated on Tue Jan 7 2014 11:42:16