#include "ORMatchingModule.h"#include "ORControlModule.h"#include <sstream>#include <fstream>#include <limits>#include <algorithm>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <sensor_msgs/Image.h>#include "Architecture/Config/Config.h"#include "Architecture/Singleton/Clock.h"#include "Workers/Math/Math.h"#include "ObjectRecognition/CvHomography.h"#include "ObjectRecognition/HoughClusterer.h"#include "ObjectRecognition/MatchHelper.h"#include "ObjectRecognition/NNRMatcher.h"#include "ObjectRecognition/SimpleHoughClusterer.h"#include "ObjectRecognition/FLANNMatcher.h"#include "KeyPointExtraction/DefaultExtractor.h"#include <ros/package.h>#include <or_msgs/OrMatchResult.h>#include <or_msgs/OrObjectNames.h>
Go to the source code of this file.
Defines | |
| #define | THIS ORMatchingModule | 
Functions | |
| bool | sizeComp (std::list< KeyPointMatch > list1, std::list< KeyPointMatch > list2) | 
| #define THIS ORMatchingModule | 
Definition at line 39 of file ORMatchingModule.cpp.
| bool sizeComp | ( | std::list< KeyPointMatch > | list1, | 
| std::list< KeyPointMatch > | list2 | ||
| ) | 
Definition at line 598 of file ORMatchingModule.cpp.