A grasp demonstration database entity. More...
#include "Entity.h"
#include "Pose.h"
#include <rail_pick_and_place_msgs/GraspDemonstration.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/PointCloud2.h>
#include <string>
Go to the source code of this file.
Classes | |
class | rail::pick_and_place::graspdb::GraspDemonstration |
A grasp demonstration database entry. More... | |
Namespaces | |
namespace | rail |
namespace | rail::pick_and_place |
namespace | rail::pick_and_place::graspdb |
A grasp demonstration database entity.
A grasp demonstration contains information about a single grasp demonstration in the grasp database. This contains information about the grasp pose, end effector frame identifier, object name, and serialized segmented point cloud. A valid database entity has an ID and created timestamp. This class is useful for internal data management within the graspdb library. Convenience functions are added for use with ROS messages.
Definition in file GraspDemonstration.h.