$search
Main file of Recognizer for 3D pose estimation using SIFT features. More...
#include <blort/Recognizer3D/DetectGPUSIFT.hh>
#include <blort/Recognizer3D/ODetect3D.hh>
#include <blort/Recognizer3D/Object3D.hh>
#include <blort/Recognizer3D/ModelObject3D.hh>
#include <blort/Recognizer3D/KeypointDescriptor.hh>
#include <blort/Recognizer3D/PoseCv.hh>
#include <blort/TomGine/tgModel.h>
#include <blort/TomGine/tgPose.h>
#include <string>
#include <opencv2/core/core.hpp>
#include <sensor_msgs/CameraInfo.h>
Go to the source code of this file.
Classes | |
struct | blortRecognizer::CameraParameter |
intrinsic camera parameter lookup OpenCV Camera Calibration and 3D Reconstruction http://opencv.willowgarage.com/documentation/cpp/camera_calibration_and_3d_reconstruction.html More... | |
class | blortRecognizer::Recognizer3D |
Recognizer for 3D pose estimation using SIFT features. More... | |
struct | blortRecognizer::Siftex |
Namespaces | |
namespace | blortRecognizer |
Main file of Recognizer for 3D pose estimation using SIFT features.
Definition in file Recognizer3D.h.