gazebo_cube_spawner.h
Go to the documentation of this file.
00001 #ifndef GAZEBO_TEST_TOOLS_GAZEBOCUBESPAWNER
00002 #define GAZEBO_TEST_TOOLS_GAZEBOCUBESPAWNER
00003 
00004 #include <ros/ros.h>
00005 
00006 namespace gazebo_test_tools {
00007 
00014 class GazeboCubeSpawner {
00015 public:
00016     GazeboCubeSpawner(ros::NodeHandle &n);
00017     
00018     void spawnCube(const std::string& name, const std::string& frame_id,
00019             float x, float y, float z, float qx, float qy, float qz, float qw,
00020             float w=0.05, float h=0.05, float d=0.05, float mass=0.05); 
00021     
00026     void spawnPrimitive(const std::string& name, const bool isCube,
00027             const std::string& frame_id,
00028             float x, float y, float z, float qx, float qy, float qz, float qw,
00029             float w=0.05, float h=0.05, float d=0.05, float mass=0.05); 
00030 
00031 private:
00032 
00033     ros::NodeHandle nh;
00034     ros::ServiceClient spawn_object;
00035 
00036 };
00037 
00038 }  // namespace 
00039 
00040 #endif  // GAZEBO_TEST_TOOLS_GAZEBOCUBESPAWNER


gazebo_test_tools
Author(s): Jennifer Buehler
autogenerated on Tue May 7 2019 03:29:23