Go to the documentation of this file.00001 #ifndef GEOMETRY_POSES_H
00002 #define GEOMETRY_POSES_H
00003
00004 #include <map>
00005 #include <string>
00006 #include <geometry_msgs/PoseStamped.h>
00007 #include <iostream>
00008
00010 class GeometryPoses
00011 {
00012 friend std::ostream & operator<<(std::ostream & os, const GeometryPoses & poses);
00013
00014 public:
00015 typedef std::pair<std::string, geometry_msgs::PoseStamped> NamedPose;
00016
00017 GeometryPoses();
00018 ~GeometryPoses();
00019
00020 bool load(const std::string & filename);
00021
00022 const std::map<std::string, geometry_msgs::PoseStamped> & getPoses() const { return _poses; };
00023
00024 protected:
00025 std::map<std::string, geometry_msgs::PoseStamped> _poses;
00026 };
00027
00028 std::ostream & operator<<(std::ostream & os, const GeometryPoses & poses);
00029
00030 #endif
00031