, including all inherited members.
| distEuclideanSq(const PointFeature &a, const PointFeature &b) | ccny_rgbd::KeyframeGraphDetector | [inline, private] |
| generateKeyframeAssociations(KeyframeVector &keyframes, KeyframeAssociationVector &associations) | ccny_rgbd::KeyframeGraphDetector | |
| getRandomIndices(int k, int n, IntVector &output) | ccny_rgbd::KeyframeGraphDetector | [private] |
| k_nearest_neighbors_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| KeyframeGraphDetector(const ros::NodeHandle &nh, const ros::NodeHandle &nh_private) | ccny_rgbd::KeyframeGraphDetector | |
| manualBruteForceAssociations(KeyframeVector &keyframes, KeyframeAssociationVector &associations) | ccny_rgbd::KeyframeGraphDetector | [private] |
| max_corresp_dist_desc_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| max_corresp_dist_eucl_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| max_corresp_dist_eucl_sq_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| max_ransac_iterations_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| min_ransac_inliers_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| n_keypoints_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| n_ransac_candidates_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| nh_ | ccny_rgbd::KeyframeGraphDetector | [protected] |
| nh_private_ | ccny_rgbd::KeyframeGraphDetector | [protected] |
| pairwiseMatchingRANSAC(RGBDFrame &frame_a, RGBDFrame &frame_b, double max_eucl_dist_sq, double max_desc_dist, double sufficient_inlier_ratio, std::vector< cv::DMatch > &all_matches, std::vector< cv::DMatch > &best_inlier_matches, Eigen::Matrix4f &best_transformation) | ccny_rgbd::KeyframeGraphDetector | [private] |
| prepareFeaturesForRANSAC(KeyframeVector &keyframes) | ccny_rgbd::KeyframeGraphDetector | [private] |
| ransac_results_path_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| save_ransac_results_ | ccny_rgbd::KeyframeGraphDetector | [private] |
| trainMatcher(const KeyframeVector &keyframes, cv::FlannBasedMatcher &matcher) | ccny_rgbd::KeyframeGraphDetector | [private] |
| treeAssociations(KeyframeVector &keyframes, KeyframeAssociationVector &associations) | ccny_rgbd::KeyframeGraphDetector | [private] |
| visualOdometryAssociations(KeyframeVector &keyframes, KeyframeAssociationVector &associations) | ccny_rgbd::KeyframeGraphDetector | [private] |
| ~KeyframeGraphDetector() | ccny_rgbd::KeyframeGraphDetector | [virtual] |