#include <sensor_msgs/PointCloud2.h>
#include <geometry_msgs/PointStamped.h>
#include <pcl_conversions/pcl_conversions.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/kdtree/kdtree_flann.h>
Go to the source code of this file.
Classes | |
struct | ImagePoint |
Functions | |
POINT_CLOUD_REGISTER_POINT_STRUCT (ImagePoint,(float, u, u)(float, v, v)(int, ind, ind)) struct DepthPoint |
POINT_CLOUD_REGISTER_POINT_STRUCT | ( | ImagePoint | , |
(float, u, u)(float, v, v)(int, ind, ind) | |||
) |
Definition at line 18 of file pointDefinition.h.