Public Member Functions | Private Attributes | List of all members
fake_object_recognition::ObjectConfig Class Reference

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::Pointbb_corners_
 
std::string id_
 
std::string mesh_name_
 
std::vector< geometry_msgs::Pointnormals_
 
geometry_msgs::Pose pose_
 
std::string type_
 

Detailed Description

This class is used to save information about an available object.

Definition at line 32 of file object_config.h.

Constructor & Destructor Documentation

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.

Parameters
typeThe name of the object
idThe id of the object
poseThe pose of the object
mesh_nameThe path to the object's mesh file

Definition at line 22 of file object_config.cpp.

Member Function Documentation

std::string fake_object_recognition::ObjectConfig::getId ( ) const

Return the id of the object.

Returns
The object's id

Definition at line 29 of file object_config.cpp.

std::string fake_object_recognition::ObjectConfig::getMeshName ( ) const

Return the mesh path of the object.

Returns
The object's mesh path

Definition at line 37 of file object_config.cpp.

geometry_msgs::Pose fake_object_recognition::ObjectConfig::getPose ( ) const

Return the pose of the object.

Returns
The object's pose

Definition at line 33 of file object_config.cpp.

std::string fake_object_recognition::ObjectConfig::getType ( ) const

Return the name of the object.

Returns
The object's name

Definition at line 25 of file object_config.cpp.

Member Data Documentation

std::vector<geometry_msgs::Point> fake_object_recognition::ObjectConfig::bb_corners_
private

The bounding box corner points of the object

Definition at line 51 of file object_config.h.

std::string fake_object_recognition::ObjectConfig::id_
private

The id of the object

Definition at line 39 of file object_config.h.

std::string fake_object_recognition::ObjectConfig::mesh_name_
private

The path to the mesh used to visualize the object

Definition at line 45 of file object_config.h.

std::vector<geometry_msgs::Point> fake_object_recognition::ObjectConfig::normals_
private

The normals of the object

Definition at line 48 of file object_config.h.

geometry_msgs::Pose fake_object_recognition::ObjectConfig::pose_
private

The pose of the object

Definition at line 42 of file object_config.h.

std::string fake_object_recognition::ObjectConfig::type_
private

The name of the object

Definition at line 36 of file object_config.h.


The documentation for this class was generated from the following files:


asr_fake_object_recognition
Author(s): Allgeyer Tobias, Aumann Florian, Borella Jocelyn, Meißner Pascal, Qattan Mohamad
autogenerated on Wed Feb 19 2020 03:58:59