18 #ifndef OBJECT_CONFIG_H 19 #define OBJECT_CONFIG_H 22 #include <geometry_msgs/Point.h> 23 #include <geometry_msgs/Pose.h> 63 ObjectConfig(
const std::string &type,
const std::string
id,
const geometry_msgs::Pose &pose,
const std::string &mesh_name);
77 std::string
getId()
const;
84 geometry_msgs::Pose
getPose()
const;
geometry_msgs::Pose getPose() const
Return the pose of the object.
geometry_msgs::Pose pose_
std::string getMeshName() const
Return the mesh path of the object.
std::vector< geometry_msgs::Point > bb_corners_
ObjectConfig(const std::string &type, const std::string id, const geometry_msgs::Pose &pose, const std::string &mesh_name)
The constructor of this class.
std::vector< geometry_msgs::Point > normals_
This class is used to save information about an available object.
std::string getId() const
Return the id of the object.
std::string getType() const
Return the name of the object.