#include <vector>
#include <opencv2/opencv.hpp>
#include <opencv2/features2d/features2d.hpp>
#include <boost/function.hpp>
#include <boost/bind.hpp>
#include <sensor_msgs/Image.h>
#include <featurenav_base/Feature.h>
Go to the source code of this file.
Namespaces | |
namespace | featurenav_base |
Typedefs | |
typedef boost::function< bool(const action_type)> | featurenav_base::can_do_function_ptr |
typedef boost::function< void(const vector< Feature > &, const vector< Feature > &, vector < vector< DMatch > > &)> | featurenav_base::descriptor_matcher_function_ptr |
typedef boost::function< void(const sensor_msgs::ImageConstPtr &, vector< KeyPoint > &, vector< Feature > &)> | featurenav_base::feature_extractor_function_ptr |
typedef boost::function< void(const action_type)> | featurenav_base::start_do_function_ptr |
Enumerations | |
enum | featurenav_base::action_type { featurenav_base::LEARN, featurenav_base::NAVIGATE } |