#include <ros/ros.h>#include <image_transport/image_transport.h>#include <image_transport/subscriber_filter.h>#include <message_filters/subscriber.h>#include <message_filters/time_synchronizer.h>#include <dynamic_reconfigure/server.h>#include <cv_bridge/CvBridge.h>#include <image_geometry/stereo_camera_model.h>#include <vslam_system/vslam.h>#include <sba/visualization.h>#include <vslam_system/any_detector.h>#include <vslam_system/StereoVslamNodeConfig.h>#include <sba/Frame.h>#include <geometry_msgs/PointStamped.h>#include <opencv2/legacy/legacy.hpp>
Go to the source code of this file.
Classes | |
| class | VONode |
Functions | |
| int | main (int argc, char **argv) |
Variables | |
| static const double | MAX_KEYFRAME_ANGLE = 0.1 |
| static const double | MAX_KEYFRAME_DISTANCE = 0.2 |
| static const int | MIN_KEYFRAME_INLIERS = 0 |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 413 of file vo_node.cpp.
const double MAX_KEYFRAME_ANGLE = 0.1 [static] |
Definition at line 25 of file vo_node.cpp.
const double MAX_KEYFRAME_DISTANCE = 0.2 [static] |
Definition at line 24 of file vo_node.cpp.
const int MIN_KEYFRAME_INLIERS = 0 [static] |
Definition at line 26 of file vo_node.cpp.