Robots change shape and are fixed/stuck.
Hey, I've been using 25 robots of the same type in a swarm simulation in **Gazebo 2.2.3** on **ROS Indigo**. After about an hour of simulation at least half the robots are fixed in the centre of the...
View ArticleControlling joints/robot without ROS
Hello! I am very new to gazebo and simulation of robots in general. I would like to know how to control several joints in one model, how it is usually done without ROS, because I am having problems to...
View ArticleRendering FPS Value : Ignition vs Gazebo
I noticed that the same scene in gzclient and in my own visualizer, that uses Qt and Ignition (based on Gazebo's API) have different FPS values. My Nvidia only reaches 60% gpu usage, 30% memory usage,...
View ArticleSimulating Actuated Joint Stiffness
Hello. I am trying to simulate a joint which actuates a lift using Gazebo 7 and ROS Indigo. The URDF definition for the joint is as follows: The lift is driven by a position controller with these...
View ArticleGet WorldPtr to the simulated world by gzserver
Hi all, I'm implementing my own simulator using Gazebo, Ignition and ROS. Using gzserver, a world file and my models, im able to get everything rendered correctly by gzserver and control everything....
View ArticleCan Gazebo reflect sensor data from real world?
Hello. I wonder whether or not Gazebo can reflect real world data in simulation. I would like to reflect 3d pointcloud data of real world in Gazebo simulation, then simulate robot in its simulation...
View ArticleIs there GUI tool for creating SDF ?
Hello, I've installed Gazebo 7 today and been trying some tutorials in this website. In every tutorial, however, SDF defines the robot was created by text editor, even there was model editor in...
View ArticlePlugin to subscribe to nav_msgs/Odometry messages
Hi guys, I am trying to control the movement of a robot inside Gazebo by publishing Odometry messages. I have already written the publisher, but now I'm looking for a way for the robot to subscribe to...
View Articlegazebo::physics::get_world crashes node
ROS Indigo on Ubuntu 14.04 with Gazebo 7 I am trying to access the models in a Gazebo world via a node. In order to do this, I am just trying to get a reference to the world. Using the `get_world`...
View ArticleModify model names during simulation
When I 'insert' a model from the Gazebo GUI, it seems I could not change its model name anymore. Is there any way to change its name after drag it into the simulation world?
View ArticleDefining a Stereo Camera in URDF for usage in Gazebo Simulations
Hello all, I have been struggling for the past few days to get a Gazebo simulation put together, and the hardest part has proven to be getting sensor data integrated in the simulation. I am trying to...
View ArticleMove model by pressing the button
Hi. I began to study plugins, and faced with the problem. There is a lesson model_pish - http://gazebosim.org/tutorials?tut=plugins_model&cat=write_plugin. I wanted to change it up a bit, but do...
View ArticleUse custom ROS message for subscribing to ROS topic
I've menaged to make my GAZEBO plugin subscribe to my ROS topic, but they can't communicate since the message are of two different types. This is the error given by ROS: [ERROR]...
View ArticleDelete model fails using gzclient
I spawned some models in the simulation using standard gzclient. Then, i have a plugin in those models that shows the models already spawned in the world. Suppose that i have 3 models : robot1, robot2...
View ArticleHow may I create a magnetic gripper, on a an arm?
I am creating a two link arm and I just want to have magnetic small plates at the end of the link to act as a magnet and I want to attach any payload to this plate, Is there any existing tutorial...
View ArticleWorld changes not saved after editing in gazebo_ros (2.2.3)
I'm working in ROS (Indigo, Ubuntu 14), starting gazebo 2.2.3 with rosrun gazebo_ros gazebo I go in and create a little corner of a room by dropping in a couple of cubes and scaling them:  tutorial, but as i enter: `roslaunch my_robot_gazebo my_robot.launch`, i cant see the world in gazebo. When...
View Article