#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <gazebo_msgs/GetModelState.h>
#include <gazebo_msgs/SetModelState.h>
#include <segbot_simulation_apps/common.h>
Go to the source code of this file.
Namespaces | |
namespace | segbot_simulation_apps |
Functions | |
bool | segbot_simulation_apps::checkClosePoses (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2, float threshold=0.05, bool check_yaw=true) |
bool | segbot_simulation_apps::teleportEntity (const std::string &entity, const geometry_msgs::Pose &pose, ros::ServiceClient &get_gazebo_model_client, ros::ServiceClient &set_gazebo_model_client) |