$search

household_objects_database Namespace Reference

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  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 DatabaseHandPosture &dhp)
std::ostream & operator<< (std::ostream &str, const DatabasePose &dhp)
std::istream & operator>> (std::istream &str, DatabaseHandPosture &dhp)
std::istream & operator>> (std::istream &str, DatabasePose &dhp)

Variables

const char * elem_names []
PlyProperty face_props []
PlyProperty vert_props []

Detailed Description

Author:
Peter Brook

Typedef Documentation

Definition at line 174 of file database_capture_region.h.

Definition at line 153 of file database_grasp.h.

Definition at line 202 of file database_object_paths.h.

Definition at line 103 of file database_perturbation.h.

Definition at line 553 of file objects_database.h.


Function Documentation

std::ostream & household_objects_database::operator<< ( std::ostream &  str,
const DatabaseHandPosture &  dhp 
)

Definition at line 79 of file database_helper_classes.cpp.

std::ostream & household_objects_database::operator<< ( std::ostream &  str,
const DatabasePose &  dhp 
)

Definition at line 55 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.

std::istream & household_objects_database::operator>> ( std::istream &  str,
DatabasePose &  dhp 
)

Definition at line 39 of file database_helper_classes.cpp.


Variable Documentation

Initial value:
 { 
  "vertex", "face"
}

Definition at line 41 of file mesh_loader.cpp.

Initial value:
 { 
  {"vertex_indices", Int32, Int32, offsetof(Face,verts),
   1, Uint8, Uint8, offsetof(Face,nverts)},
}

Definition at line 51 of file mesh_loader.cpp.

Initial value:
 { 
  {"x", Float32, Float32, offsetof(Vertex,x), 0, 0, 0, 0},
  {"y", Float32, Float32, offsetof(Vertex,y), 0, 0, 0, 0},
  {"z", Float32, Float32, offsetof(Vertex,z), 0, 0, 0, 0},
}

Definition at line 45 of file mesh_loader.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends Defines


household_objects_database
Author(s): Matei Ciocarlie, except for source files individually marked otherwise
autogenerated on Fri Mar 1 19:52:44 2013