, including all inherited members.
addPointCloud(pointcloud_type::Ptr pc_col) | Node | |
base2points_ | Node | [protected] |
buildFlannIndex() | Node | |
clearFeatureInformation() | Node | |
clearPointCloud() | Node | |
computeInliersAndError(const CONTAINER &initial_matches, const Eigen::Matrix4f &transformation, const std::vector< Eigen::Vector4f, Eigen::aligned_allocator< Eigen::Vector4f > > &origins, const std::vector< std::pair< float, float > > origins_depth_stats, const std::vector< Eigen::Vector4f, Eigen::aligned_allocator< Eigen::Vector4f > > &targets, const std::vector< std::pair< float, float > > targets_depth_stats, std::vector< cv::DMatch > &new_inliers, double &mean_error, std::vector< double > &errors, double squaredMaxInlierDistInM=0.0009) const | Node | [protected] |
feature_depth_stats_ | Node | |
feature_descriptors_ | Node | |
feature_locations_2d_ | Node | |
feature_locations_3d_ | Node | |
featureMatching(const Node *other, std::vector< cv::DMatch > *matches) const | Node | |
flannIndex | Node | [protected] |
getBase2PointsTransform() | Node | |
getGroundTruthTransform() | Node | |
getOdomTransform() | Node | |
getRelativeTransformationTo(const Node *target_node, std::vector< cv::DMatch > *initial_matches, Eigen::Matrix4f &resulting_transformation, float &rmse, std::vector< cv::DMatch > &matches) const | Node | |
getTransformFromMatches(const Node *other_node, const CONTAINER &matches, bool &valid, float max_dist_m=-1) const | Node | [protected] |
getTransformFromMatchesUmeyama(const Node *other_node, CONTAINER matches) const | Node | [protected] |
gicp_mutex | Node | [protected, static] |
ground_truth_transform_ | Node | [protected] |
id_ | Node | |
initial_node_matches_ | Node | [protected] |
mat2dist(const Eigen::Matrix4f &t, double &dist) | Node | [inline, protected] |
matchNodePair(const Node *older_node) | Node | |
Node(const cv::Mat &visual, const cv::Mat &depth, const cv::Mat &detection_mask, const sensor_msgs::CameraInfoConstPtr &cam_info, std_msgs::Header depth_header, cv::Ptr< cv::FeatureDetector > detector, cv::Ptr< cv::DescriptorExtractor > extractor) | Node | |
Node(const cv::Mat visual, cv::Ptr< cv::FeatureDetector > detector, cv::Ptr< cv::DescriptorExtractor > extractor, pointcloud_type::Ptr point_cloud, const cv::Mat detection_mask=cv::Mat()) | Node | |
Node() | Node | [inline] |
odom_transform_ | Node | [protected] |
pc_col | Node | |
projectTo3D(std::vector< cv::KeyPoint > &feature_locations_2d, std::vector< Eigen::Vector4f, Eigen::aligned_allocator< Eigen::Vector4f > > &feature_locations_3d, const pointcloud_type::ConstPtr point_cloud) | Node | [protected] |
projectTo3D(std::vector< cv::KeyPoint > &feature_locations_2d, std::vector< Eigen::Vector4f, Eigen::aligned_allocator< Eigen::Vector4f > > &feature_locations_3d, const cv::Mat &depth, const sensor_msgs::CameraInfoConstPtr &cam_info) | Node | [protected] |
publish(ros::Time timestamp, ros::Publisher pub) | Node | |
retrieveBase2CamTransformation() | Node | [protected] |
setBase2PointsTransform(tf::StampedTransform &b2p) | Node | |
setGroundTruthTransform(tf::StampedTransform gt) | Node | |
setOdomTransform(tf::StampedTransform odom) | Node | |
siftgpu_descriptors | Node | |
siftgpu_mutex | Node | [protected, static] |
~Node() | Node | |