Go to the documentation of this file.00001 #ifndef SEGBOT_SIM_APPS_COMMON_H
00002 #define SEGBOT_SIM_APPS_COMMON_H
00003
00004 #include <geometry_msgs/Pose.h>
00005
00006 namespace segbot_simulation_apps {
00007
00008 bool checkClosePoses(const geometry_msgs::Pose& p1,
00009 const geometry_msgs::Pose& p2,
00010 float threshold = 0.05,
00011 bool check_yaw = true);
00012
00013 bool teleportEntity(const std::string& entity,
00014 const geometry_msgs::Pose& pose,
00015 ros::ServiceClient& get_gazebo_model_client,
00016 ros::ServiceClient& set_gazebo_model_client);
00017
00018 }
00019
00020
00021 #endif