#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 <pcl/registration/icp.h>#include <pcl/registration/registration.h>#include "parameter_server.h"#include <tf/transform_datatypes.h>#include <QMutex>#include "matching_result.h"#include <Eigen/StdVector>

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... | |