#include <pcl/point_cloud.h>
#include <pcl_ros/point_cloud.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Quaternion.h>
Go to the source code of this file.
Classes | |
struct | observation::MeasurementReading |
Namespaces | |
observation | |
Enumerations | |
enum | ModelType { DEPTH_CAMERA = 0, THREE_DIMENSIONAL_LIDAR = 1 } |
enum ModelType |
Enumerator | |
---|---|
DEPTH_CAMERA | |
THREE_DIMENSIONAL_LIDAR |
Definition at line 49 of file measurement_reading.h.