object_config.h
Go to the documentation of this file.
00001 
00018 #ifndef OBJECT_CONFIG_H
00019 #define OBJECT_CONFIG_H
00020 
00021 #include <ros/ros.h>
00022 #include <geometry_msgs/Point.h>
00023 #include <geometry_msgs/Pose.h>
00024 #include <object_config.h>
00025 
00026 
00027 namespace fake_object_recognition {
00028 
00032 class ObjectConfig {
00033 
00034 private:
00036     std::string type_;
00037 
00039     std::string id_;
00040 
00042     geometry_msgs::Pose pose_;
00043 
00045     std::string mesh_name_;
00046 
00048     std::vector<geometry_msgs::Point> normals_;
00049 
00051     std::vector<geometry_msgs::Point> bb_corners_;
00052 
00053 
00054 public:
00063     ObjectConfig(const std::string &type, const std::string id, const geometry_msgs::Pose &pose, const std::string &mesh_name);
00064 
00070     std::string getType() const;
00071 
00077     std::string getId() const;
00078 
00084     geometry_msgs::Pose getPose() const;
00085 
00091     std::string getMeshName() const;
00092     
00093 };
00094 
00095 }
00096 
00097 
00098 #endif /* OBJECT_CONFIG_H */
00099 
00100 


asr_fake_object_recognition
Author(s): Allgeyer Tobias, Aumann Florian, Borella Jocelyn, Meißner Pascal, Qattan Mohamad
autogenerated on Sat Jun 8 2019 19:15:45