, including all inherited members.
alignedPoints(const ObjectModel::Face &face, const std::vector< int > indices) const | SurfPlanarDetector | [protected] |
calculatePose(const ObjectModel::Face &face, const std::vector< int > &face_indices, const DVision::SurfSet &scene_surfset, const std::vector< int > &scene_indices, const CameraBridge &camera, cv::Mat &cTo) const | ObjectDetectorMethod | [protected] |
changeOrientation(const cv::Mat &cTo, cv::Mat &rTo) const | ObjectDetectorMethod | [protected] |
convert3DPoints(const ObjectModel::Face &face, const std::vector< int > &indices, const cv::Mat &cTo, std::vector< geometry_msgs::Point > &points3d) const | ObjectDetectorMethod | [protected] |
convert3DPoints(const ObjectModel::Face &face, const cv::Mat &cTo, std::vector< geometry_msgs::Point > &points3d) const | ObjectDetectorMethod | [protected] |
convertPose(const cv::Mat &T, geometry_msgs::Pose &pose) const | ObjectDetectorMethod | [protected] |
debugMode() const | ObjectDetectorMethod | [inline, virtual] |
detect(ObjectDetectorMethod::DetectionData &data, ObjectModel &model, re_msgs::DetectedObject &detection) | SurfPlanarDetector | [virtual] |
detectWithHomography(const SurfSet &scene_surfset, ObjectModel &model, ObjectModel::Face &face, const std::vector< int > &model_indices, const std::vector< int > &scene_indices, const std::vector< float > &distances, const ObjectDetectorMethod::DetectionData &data, const double maxReprojectionError, bool doReChecking, re_msgs::DetectedObject &detection) | SurfPlanarDetector | [protected] |
get3DModelPoints(const ObjectModel::Face &face, const std::vector< int > &indices, std::vector< geometry_msgs::Point > &points3d) const | ObjectDetectorMethod | [protected] |
get3DModelPoints(const ObjectModel::Face &face, std::vector< geometry_msgs::Point > &points3d) const | ObjectDetectorMethod | [protected] |
getPointsOctave(const ObjectModel::Face &face, const std::vector< int > &indices, std::vector< int > &octave) const | ObjectDetectorMethod | [protected] |
getPointsOctave(const ObjectModel::Face &face, std::vector< int > &octave) const | ObjectDetectorMethod | [protected] |
m_debug | ObjectDetectorMethod | [protected] |
m_debug_dir | ObjectDetectorMethod | [protected] |
m_debug_prefix | SurfPlanarDetector | [protected] |
m_detect_counter | SurfPlanarDetector | [protected] |
m_visualizer | ObjectDetectorMethod | [protected] |
ObjectDetectorMethod(VisualizationManager *vis=NULL) | ObjectDetectorMethod | [inline, protected] |
project2DPoints(const ObjectModel::Face &face, const cv::Mat &cTo, const CameraBridge &camera, const std::vector< int > &indices, std::vector< re_msgs::Pixel > &points2d) const | ObjectDetectorMethod | [protected] |
project2DPoints(const ObjectModel::Face &face, const cv::Mat &cTo, const CameraBridge &camera, std::vector< re_msgs::Pixel > &points2d) const | ObjectDetectorMethod | [protected] |
setDebugMode(bool onoff, const std::string &dir) | ObjectDetectorMethod | [inline, virtual] |
setVisualizationManager(VisualizationManager *vis) | ObjectDetectorMethod | [inline, virtual] |
SurfPlanarDetector() | SurfPlanarDetector | [inline] |
visualizationMode() const | ObjectDetectorMethod | [inline, virtual] |
visualize(const cv::Mat &image, const std::string &text="", bool hold=false) | ObjectDetectorMethod | [inline, protected] |
~SurfPlanarDetector() | SurfPlanarDetector | [inline, virtual] |