This class is used to save information about an available object. More...
#include <object_config.h>
Public Member Functions | |
std::string | getId () const |
Return the id of the object. More... | |
std::string | getMeshName () const |
Return the mesh path of the object. More... | |
geometry_msgs::Pose | getPose () const |
Return the pose of the object. More... | |
std::string | getType () const |
Return the name of the object. More... | |
ObjectConfig (const std::string &type, const std::string id, const geometry_msgs::Pose &pose, const std::string &mesh_name) | |
The constructor of this class. More... | |
Private Attributes | |
std::vector< geometry_msgs::Point > | bb_corners_ |
std::string | id_ |
std::string | mesh_name_ |
std::vector< geometry_msgs::Point > | normals_ |
geometry_msgs::Pose | pose_ |
std::string | type_ |
This class is used to save information about an available object.
Definition at line 32 of file object_config.h.
fake_object_recognition::ObjectConfig::ObjectConfig | ( | const std::string & | type, |
const std::string | id, | ||
const geometry_msgs::Pose & | pose, | ||
const std::string & | mesh_name | ||
) |
The constructor of this class.
type | The name of the object |
id | The id of the object |
pose | The pose of the object |
mesh_name | The path to the object's mesh file |
Definition at line 22 of file object_config.cpp.
std::string fake_object_recognition::ObjectConfig::getId | ( | ) | const |
Return the id of the object.
Definition at line 29 of file object_config.cpp.
std::string fake_object_recognition::ObjectConfig::getMeshName | ( | ) | const |
Return the mesh path of the object.
Definition at line 37 of file object_config.cpp.
geometry_msgs::Pose fake_object_recognition::ObjectConfig::getPose | ( | ) | const |
Return the pose of the object.
Definition at line 33 of file object_config.cpp.
std::string fake_object_recognition::ObjectConfig::getType | ( | ) | const |
Return the name of the object.
Definition at line 25 of file object_config.cpp.
|
private |
The bounding box corner points of the object
Definition at line 51 of file object_config.h.
|
private |
The id of the object
Definition at line 39 of file object_config.h.
|
private |
The path to the mesh used to visualize the object
Definition at line 45 of file object_config.h.
|
private |
The normals of the object
Definition at line 48 of file object_config.h.
|
private |
The pose of the object
Definition at line 42 of file object_config.h.
|
private |
The name of the object
Definition at line 36 of file object_config.h.