#include <custom_landmark_2d/matcher.h>#include <opencv2/highgui/highgui.hpp>#include <opencv2/imgproc/imgproc.hpp>#include <sensor_msgs/CameraInfo.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <image_geometry/pinhole_camera_model.h>#include <stdlib.h>#include <assert.h>
Go to the source code of this file.
| Namespaces | |
| namespace | custom_landmark_2d | 
| Typedefs | |
| typedef pcl::PointXYZRGB | PointC | 
| typedef pcl::PointCloud < pcl::PointXYZRGB > | PointCloudC | 
| typedef pcl::PointXYZRGB PointC | 
Definition at line 16 of file matcher.cpp.
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloudC | 
Definition at line 17 of file matcher.cpp.