object_config.h
Go to the documentation of this file.
1 
18 #ifndef OBJECT_CONFIG_H
19 #define OBJECT_CONFIG_H
20 
21 #include <ros/ros.h>
22 #include <geometry_msgs/Point.h>
23 #include <geometry_msgs/Pose.h>
24 #include <object_config.h>
25 
26 
27 namespace fake_object_recognition {
28 
32 class ObjectConfig {
33 
34 private:
36  std::string type_;
37 
39  std::string id_;
40 
42  geometry_msgs::Pose pose_;
43 
45  std::string mesh_name_;
46 
48  std::vector<geometry_msgs::Point> normals_;
49 
51  std::vector<geometry_msgs::Point> bb_corners_;
52 
53 
54 public:
63  ObjectConfig(const std::string &type, const std::string id, const geometry_msgs::Pose &pose, const std::string &mesh_name);
64 
70  std::string getType() const;
71 
77  std::string getId() const;
78 
84  geometry_msgs::Pose getPose() const;
85 
91  std::string getMeshName() const;
92 
93 };
94 
95 }
96 
97 
98 #endif /* OBJECT_CONFIG_H */
99 
100 
geometry_msgs::Pose getPose() const
Return the pose of the object.
std::string getMeshName() const
Return the mesh path of the object.
std::vector< geometry_msgs::Point > bb_corners_
Definition: object_config.h:51
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_
Definition: object_config.h:48
This class is used to save information about an available object.
Definition: object_config.h:32
std::string getId() const
Return the id of the object.
std::string getType() const
Return the name of the object.


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