#include <sensor_msgs/CameraInfo.h>
#include <opencv2/opencv.hpp>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <image_geometry/pinhole_camera_model.h>
Go to the source code of this file.
Classes | |
class | custom_landmark_2d::Frame |
Represents a single instance of matched object in the 2D rgb scene. More... | |
class | custom_landmark_2d::Matcher |
The main API for 2D object recognition and projection to 3D pointclouds. More... | |
Namespaces | |
namespace | custom_landmark_2d |