#include <gazebo_cube_spawner.h>
Public Member Functions | |
| GazeboCubeSpawner (ros::NodeHandle &n) | |
| void | spawnCube (const std::string &name, const std::string &frame_id, float x, float y, float z, float qx, float qy, float qz, float qw, float w=0.05, float h=0.05, float d=0.05, float mass=0.05) |
| void | spawnPrimitive (const std::string &name, const bool isCube, const std::string &frame_id, float x, float y, float z, float qx, float qy, float qz, float qw, float w=0.05, float h=0.05, float d=0.05, float mass=0.05) |
Private Attributes | |
| ros::NodeHandle | nh |
| ros::ServiceClient | spawn_object |
Spawns a cube of given size, position and orientation into Gazebo.
Definition at line 14 of file gazebo_cube_spawner.h.
Definition at line 17 of file cube_spawner.cpp.
| void GazeboCubeSpawner::spawnCube | ( | const std::string & | name, |
| const std::string & | frame_id, | ||
| float | x, | ||
| float | y, | ||
| float | z, | ||
| float | qx, | ||
| float | qy, | ||
| float | qz, | ||
| float | qw, | ||
| float | w = 0.05, |
||
| float | h = 0.05, |
||
| float | d = 0.05, |
||
| float | mass = 0.05 |
||
| ) |
Definition at line 21 of file cube_spawner.cpp.
| void GazeboCubeSpawner::spawnPrimitive | ( | const std::string & | name, |
| const bool | isCube, | ||
| const std::string & | frame_id, | ||
| float | x, | ||
| float | y, | ||
| float | z, | ||
| float | qx, | ||
| float | qy, | ||
| float | qz, | ||
| float | qw, | ||
| float | w = 0.05, |
||
| float | h = 0.05, |
||
| float | d = 0.05, |
||
| float | mass = 0.05 |
||
| ) |
| isCube | if true, spawn a cube. If false, spawn cylinder, where w is the radius and h is the height (d will be ignored). |
Definition at line 28 of file cube_spawner.cpp.
Definition at line 33 of file gazebo_cube_spawner.h.
Definition at line 34 of file gazebo_cube_spawner.h.