Classes | |
class | DatabaseCaptureRegion |
Contains a database record of a capture region. More... | |
class | DatabaseFilePath |
class | DatabaseGrasp |
Contains a database record of a grasp. More... | |
class | DatabaseGraspPair |
Contains a database record of a grasp. More... | |
class | DatabaseHandPosture |
A wrapper for a vector of doubles, used in the database to store the hand joint angles. More... | |
class | DatabaseMesh |
class | DatabaseObjectPaths |
Contains a database record of a capture region. More... | |
class | DatabaseOptimizationResult |
class | DatabaseOptimizationTask |
class | DatabaseOriginalModel |
The C++ version of an original model entry in the database. More... | |
class | DatabasePerturbation |
Contains a database record of a grasp. More... | |
class | DatabasePlanningTask |
Contains a model name, a hand name and a time for planning. More... | |
class | DatabasePose |
A wrapper for the geometry_msgs::pose so we can store it in the database. More... | |
class | DatabaseScaledModel |
class | DatabaseScan |
class | DatabaseTask |
class | DatabaseTaskID |
The ID of a task to be retrieved from the special get_mark_next_task() function. More... | |
class | DatabaseTaskIDTyped |
The ID of a task to be retrieved from the special get_mark_next_task() function. More... | |
class | DatabaseVFH |
class | DatabaseVFHOrientation |
class | DatabaseView |
struct | Face |
class | HandFilePath |
class | ObjectsDatabase |
A slight specialization of the general database interface with a few convenience functions added. More... | |
class | PLYModelLoader |
struct | Vertex |
Typedefs | |
typedef boost::shared_ptr < DatabaseCaptureRegion > | DatabaseCaptureRegionPtr |
typedef boost::shared_ptr < DatabaseGrasp > | DatabaseGraspPtr |
typedef boost::shared_ptr < DatabaseObjectPaths > | DatabaseObjectPathsPtr |
typedef boost::shared_ptr < DatabasePerturbation > | DatabasePerturbationPtr |
typedef struct household_objects_database::Face | Face |
typedef boost::shared_ptr < ObjectsDatabase > | ObjectsDatabasePtr |
typedef struct household_objects_database::Vertex | Vertex |
Functions | |
std::ostream & | operator<< (std::ostream &str, const DatabasePose &dhp) |
std::ostream & | operator<< (std::ostream &str, const DatabaseHandPosture &dhp) |
std::istream & | operator>> (std::istream &str, DatabasePose &dhp) |
std::istream & | operator>> (std::istream &str, DatabaseHandPosture &dhp) |
Variables | |
const char * | elem_names [] |
PlyProperty | face_props [] |
PlyProperty | vert_props [] |
typedef boost::shared_ptr<DatabaseCaptureRegion> household_objects_database::DatabaseCaptureRegionPtr |
Definition at line 174 of file database_capture_region.h.
typedef boost::shared_ptr<DatabaseGrasp> household_objects_database::DatabaseGraspPtr |
Definition at line 153 of file database_grasp.h.
typedef boost::shared_ptr<DatabaseObjectPaths> household_objects_database::DatabaseObjectPathsPtr |
Definition at line 202 of file database_object_paths.h.
typedef boost::shared_ptr<DatabasePerturbation> household_objects_database::DatabasePerturbationPtr |
Definition at line 103 of file database_perturbation.h.
typedef struct household_objects_database::Face household_objects_database::Face |
typedef boost::shared_ptr<ObjectsDatabase> household_objects_database::ObjectsDatabasePtr |
Definition at line 553 of file objects_database.h.
std::ostream & household_objects_database::operator<< | ( | std::ostream & | str, |
const DatabasePose & | dhp | ||
) |
Definition at line 55 of file database_helper_classes.cpp.
std::ostream & household_objects_database::operator<< | ( | std::ostream & | str, |
const DatabaseHandPosture & | dhp | ||
) |
Definition at line 79 of file database_helper_classes.cpp.
std::istream & household_objects_database::operator>> | ( | std::istream & | str, |
DatabasePose & | dhp | ||
) |
Definition at line 39 of file database_helper_classes.cpp.
std::istream & household_objects_database::operator>> | ( | std::istream & | str, |
DatabaseHandPosture & | dhp | ||
) |
Definition at line 64 of file database_helper_classes.cpp.
const char* household_objects_database::elem_names[] |
{ "vertex", "face" }
Definition at line 41 of file mesh_loader.cpp.