#include "ros/ros.h"#include <vector>#include <opencv2/core/core.hpp>#include <opencv2/features2d/features2d.hpp>#include <Eigen/Core>#include <sensor_msgs/PointCloud2.h>#include <sensor_msgs/CameraInfo.h>#include "parameter_server.h"#include <tf/transform_datatypes.h>#include <QMutex>#include "matching_result.h"#include <Eigen/StdVector>#include "header.h"

Go to the source code of this file.
Classes | |
| class | Node |
| Holds the data for one graph node and provides functionality to compute relative transformations to other Nodes. More... | |
Typedefs | |
| typedef std::vector < Eigen::Vector4f, Eigen::aligned_allocator < Eigen::Vector4f > > | std_vector_of_eigen_vector4f |
Functions | |
| void | pairwiseObservationLikelihood (const Node *newer_node, const Node *older_node, MatchingResult &mr) |
| void | squareroot_descriptor_space (cv::Mat &feature_descriptors) |
| Compute the RootSIFT from SIFT according to Arandjelovic and Zisserman. | |
| typedef std::vector<Eigen::Vector4f, Eigen::aligned_allocator<Eigen::Vector4f> > std_vector_of_eigen_vector4f |
| void pairwiseObservationLikelihood | ( | const Node * | newer_node, |
| const Node * | older_node, | ||
| MatchingResult & | mr | ||
| ) |
| void squareroot_descriptor_space | ( | cv::Mat & | feature_descriptors | ) |