#include <string>
#include <vector>
#include <algorithm>
#include "tf/transform_datatypes.h"
#include "geometry_msgs/Point32.h"
#include "sensor_msgs/PointCloud.h"
#include "shape_msgs/Mesh.h"
Go to the source code of this file.
Classes | |
class | tabletop_object_detector::DistanceFieldFitter |
An individual fitter equipped with a distance field stored as a voxel grid. More... | |
class | tabletop_object_detector::ModelFitInfo |
Holds information about the fit betwen a mesh and a point cloud. More... | |
class | tabletop_object_detector::ModelToCloudFitter |
The interface for a class that can fit an individual mesh to a point cloud. More... | |
Namespaces | |
namespace | distance_field |
namespace | tabletop_object_detector |