This is the complete list of members for
ORMatchingModule, including all inherited members.
addObjectProperties(ObjectProperties *newProperties) | ORMatchingModule | |
callbackExtractKeyPoints(const or_msgs::ExtractKeyPoints::ConstPtr &msg) | ORMatchingModule | |
callbackImage(const sensor_msgs::Image::ConstPtr &message) | ORMatchingModule | |
callbackOrCommand(const or_msgs::OrCommand::ConstPtr &msg) | ORMatchingModule | |
Flann enum value | ORMatchingModule | [private] |
getSceneKeyPointsWithinOutline(std::vector< KeyPoint > *sceneKeyPoints, Homography &homography, std::list< KeyPointMatch > &stage3Matches) | ORMatchingModule | [private] |
HoughClustering enum value | ORMatchingModule | [private] |
m_BoundingBoxes | ORMatchingModule | [private] |
m_DebugImagePublisherColor | ORMatchingModule | [private] |
m_ExtractKeyPointsSubscriber | ORMatchingModule | [private] |
m_Extractor | ORMatchingModule | [private] |
m_FlannMatcher | ORMatchingModule | [private] |
m_ImageHeight | ORMatchingModule | [private] |
m_ImagesRequested | ORMatchingModule | [private] |
m_ImageSubscriber | ORMatchingModule | [private] |
m_ImageWidth | ORMatchingModule | [private] |
m_ObjectList | ORMatchingModule | [private] |
m_OrCommandSubscriber | ORMatchingModule | [private] |
m_ORMatchResultPublisher | ORMatchingModule | [private] |
m_ORObjectNamesPublisher | ORMatchingModule | [private] |
m_ProcessingTimes | ORMatchingModule | [private] |
m_Stage1Matcher | ORMatchingModule | [private] |
m_Stage2Matcher | ORMatchingModule | [private] |
matchObject(std::vector< KeyPoint > *sceneKeyPoints, ObjectProperties &objectProperties, MatchResult &matchResult) | ORMatchingModule | [private] |
matchStage1(std::vector< KeyPoint > *sceneKeyPoints, ImagePropertiesCV *objectImageProperties) | ORMatchingModule | [private] |
matchStage1Flan(ImagePropertiesCV *objectImageProperties) | ORMatchingModule | [private] |
matchStage2(std::vector< KeyPoint > *sceneKeyPoints, ImagePropertiesCV *objectImageProperties, std::list< KeyPointMatch > &stage1Matches) | ORMatchingModule | [private] |
matchStage3(std::vector< KeyPoint > *sceneKeyPoints, ImagePropertiesCV *objImageProperties, std::vector< std::list< KeyPointMatch > > &stage2Matches, Homography &homography) | ORMatchingModule | [private] |
NearestNeighbor enum value | ORMatchingModule | [private] |
ORMatchingModule(ros::NodeHandle *nh, std::string inputTopic) | ORMatchingModule | |
processImageMessage(const sensor_msgs::Image::ConstPtr &message) | ORMatchingModule | |
processImages(cv::Mat *image, int seqNum, std::vector< Box2D< int > > boundingBoxes=std::vector< Box2D< int > >()) | ORMatchingModule | [private] |
processKeyPoints(cv::Mat *image, std::vector< KeyPoint > *rawKeyPoints, std::vector< Box2D< int > > boundingBoxes, unsigned seqNum) | ORMatchingModule | [private] |
removeObjectProperties(std::string name) | ORMatchingModule | [private] |
sendObjectNames() | ORMatchingModule | [private] |
SimpleHoughClustering enum value | ORMatchingModule | [private] |
Stage1MatcherT enum name | ORMatchingModule | [private] |
Stage2MatcherT enum name | ORMatchingModule | [private] |
~ORMatchingModule() | ORMatchingModule | [virtual] |