39 #ifndef MBF_ABSTRACT_NAV__ROBOT_INFORMATION_H_ 40 #define MBF_ABSTRACT_NAV__ROBOT_INFORMATION_H_ 42 #include <boost/shared_ptr.hpp> 43 #include <geometry_msgs/PoseStamped.h> 44 #include <geometry_msgs/TwistStamped.h> 61 const std::string &global_frame,
62 const std::string &robot_frame,
65 bool getRobotPose(geometry_msgs::PoseStamped &robot_pose)
const;
89 #endif //MBF_ABSTRACT_NAV__ROBOT_INFORMATION_H_