#include <sensor_msgs/PointCloud.h>
#include <geometric_shapes/bodies.h>
#include <boost/function.hpp>
#include <string>
#include <vector>
#include <set>
#include <map>
#include <boost/thread/mutex.hpp>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
Go to the source code of this file.
Classes | |
struct | point_containment_filter::ShapeMask::SeeShape |
class | point_containment_filter::ShapeMask |
Computing a mask for a pointcloud that states which points are inside the robot. More... | |
struct | point_containment_filter::ShapeMask::SortBodies |
Namespaces | |
namespace | point_containment_filter |
Typedefs | |
typedef unsigned int | point_containment_filter::ShapeHandle |