Package Summary

Tags No category tags.
Version 3.7.0
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version ros2
Last Updated 2023-11-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.7.0 (2022-06-13)

  • Fix gzserver launch file breaking when no ros args provided (#1395)
  • Multiple nodes with same name issue (#1394)
  • Expose launch parameter for params_file (#1391)
  • Contributors: Brian Chen, Deepanshu Bansal, Jacob Perron

3.6.0 (2022-05-10)

  • Fixes gazebo shutdown error when using nested launch files (#1376)
  • Fix test failures (#1380)
  • Fix spawn_entity_demo: use executable (#1349)
  • Add runtime warning when user sets use_sim_time parameter
  • Add ROS parameter to toggle performance metrics in gazebo_ros (#1295)
  • Deprecate -spawn_service_timeout option (#1238)
  • Contributors: Aditya Pande, Daisuke Nishimatsu, Felix Exner, Jacob Perron

3.5.2 (2021-03-15)

  • Remove slash from gazebo_ros scripts Python package name (#1251)
  • Fix line length in gazebo_ros/test/CMakeLists.txt (#1249)
  • gazebo_ros: use lxml in spawn_entity.py (#1221) The python xml.etree.ElementTree library does not handle xml namespaces well, replacing namespaces of prefixed elements with ns0, ns1, etc. This switches to using lxml instead, which has the same syntax and is already used by other ros2 packages. * Add a test
  • Fix tests for cyclonedds (#1228) The default RMW implementation changed recently and some tests are now failing. This fixes the tests. * Use KeepLast(1) with transient_local in tests There are some QoS incompatibilities in some tests that use SystemDefaultsQoS, so this changes them to use KeepLast(1) with transient_local instead. This fixes some of the test failures but not all.
    • test_sim_time: allow more startup messages
    • Fix QoS and initialization of joint state pub test
  • Fix executor to avoid random exceptions when shutting down (#1212)
    • Fix executor to avoid random exceptions when shutting down
    • Add link to related issue in rclcpp
  • ros2: Only subscribe to /gazebo/performance_metrics when necessary (#1205) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. This changes gazebo_ros_init to only subscribe to the gazebo topic if there are any subscribers to the corresponding ROS topic. While advertiser callbacks are used in ROS 1 but are not yet in ROS2, here we use polling in the GazeboRosInitPrivate::PublishSimTime callback to check for subscribers since it is called for each Gazebo time step. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a macro to reduce duplication of the version checking logic.
  • Contributors: Ivan Santiago Paunovic, Michel Hidalgo, Steve Peters

3.5.1 (2020-11-25)

  • colcon.pkg: build gazebo first in colcon workspace (#1192) Add a colcon.pkg file to gazebo_dev with gazebo\'s cmake project name \"Gazebo\" listed as a dependency to support building gazebo from source in a colcon workspace. * Add colcon.pkg files for other packages Copy colcon.pkg to gazebo_ros, gazebo_plugins, and gazebo_ros_control so that --merge-install won\'t be required. Signed-off-by: Steve Peters <scpeters@openrobotics.org>

  • Fixed Parameterized testing on Rolling (#1184) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [ROS 2] Bridge to republish PerformanceMetrics in ROS 2 (#1147) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [Windows] Add missing visibility control. (#1150)

  • [ros2] Enable the force system on launch files (#1035) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • make compile wo/ warnings on osx (#1149) Signed-off-by: Karsten Knese <Karsten1987@users.noreply.github.com>

  • Added lockstep argument to gzserver (#1146) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_description github-4am-robotics-cob_common
raw_description github-4am-robotics-cob_common
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
gazebo_video_monitor_plugins github-nlamprian-gazebo_video_monitors
mir_gazebo github-DFKI-NI-mir_robot
urdf_sim_tutorial github-ros-urdf_sim_tutorial
velodyne_gazebo_plugins bitbucket-DataspeedInc-velodyne_simulator
pmb2_gazebo github-pal-robotics-pmb2_simulation
aws_robomaker_small_warehouse_world github-aws-robotics-aws-robomaker-small-warehouse-world
gazebo_ros2_control github-ros-simulation-gazebo_ros2_control
gazebo_ros2_control_demos github-ros-simulation-gazebo_ros2_control
rmf_building_sim_gz_classic_plugins github-open-rmf-rmf_simulation
rmf_robot_sim_gz_classic_plugins github-open-rmf-rmf_simulation
sm_dance_bot github-robosoft-ai-SMACC2
sm_dance_bot_warehouse github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_2 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_3 github-robosoft-ai-SMACC2
sm_dance_bot_warehouse_4 github-robosoft-ai-SMACC2
turtlebot3_manipulation_bringup github-ROBOTIS-GIT-turtlebot3_manipulation
irobot_create_gazebo_bringup github-iRobotEducation-create3_sim
irobot_create_gazebo_plugins github-iRobotEducation-create3_sim
boeing_gazebo_model_attachment_plugin github-Boeing-gazebo_model_attachment_plugin
gazebo_set_joint_positions_plugin github-Boeing-gazebo_set_joint_positions_plugin
andino_gz_classic github-Ekumen-OS-andino
gazebo_no_physics_plugin github-Boeing-gazebo_no_physics_plugin
gazebo_planar_move_plugin github-Boeing-gazebo_planar_move_plugin
gazebo_collision_plugin github-MetroRobots-metro_gazebo_plugins
pal_gazebo_plugins github-pal-robotics-pal_gazebo_plugins
tiago_gazebo github-pal-robotics-tiago_simulation

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.7.0
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version ros2
Last Updated 2023-11-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.7.0 (2022-06-13)

  • Fix gzserver launch file breaking when no ros args provided (#1395)
  • Multiple nodes with same name issue (#1394)
  • Expose launch parameter for params_file (#1391)
  • Contributors: Brian Chen, Deepanshu Bansal, Jacob Perron

3.6.0 (2022-05-10)

  • Fixes gazebo shutdown error when using nested launch files (#1376)
  • Fix test failures (#1380)
  • Fix spawn_entity_demo: use executable (#1349)
  • Add runtime warning when user sets use_sim_time parameter
  • Add ROS parameter to toggle performance metrics in gazebo_ros (#1295)
  • Deprecate -spawn_service_timeout option (#1238)
  • Contributors: Aditya Pande, Daisuke Nishimatsu, Felix Exner, Jacob Perron

3.5.2 (2021-03-15)

  • Remove slash from gazebo_ros scripts Python package name (#1251)
  • Fix line length in gazebo_ros/test/CMakeLists.txt (#1249)
  • gazebo_ros: use lxml in spawn_entity.py (#1221) The python xml.etree.ElementTree library does not handle xml namespaces well, replacing namespaces of prefixed elements with ns0, ns1, etc. This switches to using lxml instead, which has the same syntax and is already used by other ros2 packages. * Add a test
  • Fix tests for cyclonedds (#1228) The default RMW implementation changed recently and some tests are now failing. This fixes the tests. * Use KeepLast(1) with transient_local in tests There are some QoS incompatibilities in some tests that use SystemDefaultsQoS, so this changes them to use KeepLast(1) with transient_local instead. This fixes some of the test failures but not all.
    • test_sim_time: allow more startup messages
    • Fix QoS and initialization of joint state pub test
  • Fix executor to avoid random exceptions when shutting down (#1212)
    • Fix executor to avoid random exceptions when shutting down
    • Add link to related issue in rclcpp
  • ros2: Only subscribe to /gazebo/performance_metrics when necessary (#1205) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. This changes gazebo_ros_init to only subscribe to the gazebo topic if there are any subscribers to the corresponding ROS topic. While advertiser callbacks are used in ROS 1 but are not yet in ROS2, here we use polling in the GazeboRosInitPrivate::PublishSimTime callback to check for subscribers since it is called for each Gazebo time step. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a macro to reduce duplication of the version checking logic.
  • Contributors: Ivan Santiago Paunovic, Michel Hidalgo, Steve Peters

3.5.1 (2020-11-25)

  • colcon.pkg: build gazebo first in colcon workspace (#1192) Add a colcon.pkg file to gazebo_dev with gazebo\'s cmake project name \"Gazebo\" listed as a dependency to support building gazebo from source in a colcon workspace. * Add colcon.pkg files for other packages Copy colcon.pkg to gazebo_ros, gazebo_plugins, and gazebo_ros_control so that --merge-install won\'t be required. Signed-off-by: Steve Peters <scpeters@openrobotics.org>

  • Fixed Parameterized testing on Rolling (#1184) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [ROS 2] Bridge to republish PerformanceMetrics in ROS 2 (#1147) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [Windows] Add missing visibility control. (#1150)

  • [ros2] Enable the force system on launch files (#1035) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • make compile wo/ warnings on osx (#1149) Signed-off-by: Karsten Knese <Karsten1987@users.noreply.github.com>

  • Added lockstep argument to gzserver (#1146) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.7.0
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version ros2
Last Updated 2023-11-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.7.0 (2022-06-13)

  • Fix gzserver launch file breaking when no ros args provided (#1395)
  • Multiple nodes with same name issue (#1394)
  • Expose launch parameter for params_file (#1391)
  • Contributors: Brian Chen, Deepanshu Bansal, Jacob Perron

3.6.0 (2022-05-10)

  • Fixes gazebo shutdown error when using nested launch files (#1376)
  • Fix test failures (#1380)
  • Fix spawn_entity_demo: use executable (#1349)
  • Add runtime warning when user sets use_sim_time parameter
  • Add ROS parameter to toggle performance metrics in gazebo_ros (#1295)
  • Deprecate -spawn_service_timeout option (#1238)
  • Contributors: Aditya Pande, Daisuke Nishimatsu, Felix Exner, Jacob Perron

3.5.2 (2021-03-15)

  • Remove slash from gazebo_ros scripts Python package name (#1251)
  • Fix line length in gazebo_ros/test/CMakeLists.txt (#1249)
  • gazebo_ros: use lxml in spawn_entity.py (#1221) The python xml.etree.ElementTree library does not handle xml namespaces well, replacing namespaces of prefixed elements with ns0, ns1, etc. This switches to using lxml instead, which has the same syntax and is already used by other ros2 packages. * Add a test
  • Fix tests for cyclonedds (#1228) The default RMW implementation changed recently and some tests are now failing. This fixes the tests. * Use KeepLast(1) with transient_local in tests There are some QoS incompatibilities in some tests that use SystemDefaultsQoS, so this changes them to use KeepLast(1) with transient_local instead. This fixes some of the test failures but not all.
    • test_sim_time: allow more startup messages
    • Fix QoS and initialization of joint state pub test
  • Fix executor to avoid random exceptions when shutting down (#1212)
    • Fix executor to avoid random exceptions when shutting down
    • Add link to related issue in rclcpp
  • ros2: Only subscribe to /gazebo/performance_metrics when necessary (#1205) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. This changes gazebo_ros_init to only subscribe to the gazebo topic if there are any subscribers to the corresponding ROS topic. While advertiser callbacks are used in ROS 1 but are not yet in ROS2, here we use polling in the GazeboRosInitPrivate::PublishSimTime callback to check for subscribers since it is called for each Gazebo time step. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a macro to reduce duplication of the version checking logic.
  • Contributors: Ivan Santiago Paunovic, Michel Hidalgo, Steve Peters

3.5.1 (2020-11-25)

  • colcon.pkg: build gazebo first in colcon workspace (#1192) Add a colcon.pkg file to gazebo_dev with gazebo\'s cmake project name \"Gazebo\" listed as a dependency to support building gazebo from source in a colcon workspace. * Add colcon.pkg files for other packages Copy colcon.pkg to gazebo_ros, gazebo_plugins, and gazebo_ros_control so that --merge-install won\'t be required. Signed-off-by: Steve Peters <scpeters@openrobotics.org>

  • Fixed Parameterized testing on Rolling (#1184) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [ROS 2] Bridge to republish PerformanceMetrics in ROS 2 (#1147) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [Windows] Add missing visibility control. (#1150)

  • [ros2] Enable the force system on launch files (#1035) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • make compile wo/ warnings on osx (#1149) Signed-off-by: Karsten Knese <Karsten1987@users.noreply.github.com>

  • Added lockstep argument to gzserver (#1146) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.9.2
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version noetic-devel
Last Updated 2023-11-22
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • Alejandro Hernández Cordero
  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.9.2 (2021-04-21)

  • Only subscribe to /gazebo/performance_metrics when necessary (#1202) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. The link_states and model_states topics currently use an advertise mechanism with callbacks when a subscriber connects or disconnects, so I\'ve used that same pattern for the performance_metrics topic. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a GAZEBO_ROS_HAS_PERFORMANCE_METRICS macro that reduces duplication of the version checking logic for performance metrics in gazebo and adds fixes some doc-string and typos in existing code
  • [Noetic] Bridge to republish PerformanceMetrics in ROS (#1145) Co-authored-by: Ian Chen <ichen@osrfoundation.org>
  • delete request msgs (#1160)
  • gazebo_ros_api_plugin cleanup (#1137) Remove an unused overload of publishSimTime and add doxygen for the remaining publishSimTime function. * Remove duplicate code for /clock advertisement The /clock topic is advertised in both loadGazeboRosApiPlugin and advertiseServices. This removes the code from advertiseServices and moves it earlier in loadGazeboRosApiPlugin. Co-authored-by: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_gazebo_plugins github-AinsteinAI-ainstein_radar
astrobee_gazebo github-nasa-astrobee
audibot_gazebo github-robustify-audibot
cob_description github-4am-robotics-cob_common
raw_description github-4am-robotics-cob_common
cob_gazebo_plugins github-ipa320-cob_gazebo_plugins
cob_gazebo_ros_control github-ipa320-cob_gazebo_plugins
cob_bringup_sim github-ipa320-cob_simulation
cob_gazebo github-ipa320-cob_simulation
cob_gazebo_objects github-ipa320-cob_simulation
cob_gazebo_worlds github-ipa320-cob_simulation
dingo_gazebo github-dingo-cpr-dingo_simulator
franka_gazebo github-frankaemika-franka_ros
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_control github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
gazebo_video_monitor_plugins github-nlamprian-gazebo_video_monitors
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_worlds github-tu-darmstadt-ros-pkg-hector_gazebo
husky_gazebo github-husky-husky
jackal_gazebo github-jackal-jackal_simulator
drone_assets github-JdeRobot-drones
eusurdf github-jsk-ros-pkg-jsk_model_tools
khi_rs_gazebo github-Kawasaki-Robotics-khi_robot
leo_gazebo github-LeoRover-leo_simulator
leo_gazebo_plugins github-LeoRover-leo_simulator
leo_gazebo_worlds github-LeoRover-leo_simulator
mir_gazebo github-DFKI-NI-mir_robot
open_manipulator_p_gazebo github-ROBOTIS-GIT-open_manipulator_p_simulations
open_manipulator_gazebo github-ROBOTIS-GIT-open_manipulator_simulations
prbt_gazebo github-PilzDE-pilz_robots
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
ridgeback_gazebo github-ridgeback-ridgeback_simulator
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
roboticsgroup_upatras_gazebo_plugins github-roboticsgroup-roboticsgroup_upatras_gazebo_plugins
robotont_gazebo github-robotont-robotont_gazebo
turtlebot3_gazebo github-ROBOTIS-GIT-turtlebot3_simulations
ur_gazebo github-ros-industrial-universal_robot
urdf_sim_tutorial github-ros-urdf_sim_tutorial
velodyne_gazebo_plugin github-beltransen-velo2cam_gazebo
velodyne_gazebo_plugins bitbucket-DataspeedInc-velodyne_simulator
warthog_gazebo github-warthog-cpr-warthog_simulator
clober_simulation github-CLOBOT-Co-Ltd-clober
diffbot_gazebo github-ros-mobile-robots-diffbot
gazebo_custom_sensor_preloader github-ctu-vras-gazebo_custom_sensor_preloader
boeing_gazebo_model_attachment_plugin github-Boeing-gazebo_model_attachment_plugin
gazebo_ros_control_select_joints github-tu-darmstadt-ros-pkg-gazebo_ros_control_select_joints
gazebo_set_joint_positions_plugin github-Boeing-gazebo_set_joint_positions_plugin
rm_gazebo github-rm-controls-rm_control
thunder_line_follower_pmr3100 github-ThundeRatz-thunder_line_follower_pmr3100

Launch files

  • launch/willowgarage_world.launch
  • launch/empty_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: false]
      • output [default: screen]
      • world_name [default: worlds/empty.world]
      • respawn_gazebo [default: false]
      • use_clock_frequency [default: false]
      • pub_clock_frequency [default: 100]
      • enable_ros_network [default: true]
      • server_required [default: false]
      • gui_required [default: false]
  • launch/range_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world [default: gazebo_ros_range]
  • launch/elevator_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world_name [default: worlds/elevator_ros.world]
  • launch/mud_world.launch
  • launch/rubble_world.launch
  • launch/shapes_world.launch

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 3.2.0
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version crystal
Last Updated 2019-04-03
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.2.0 (2019-03-13)

  • [ros2] Disable test_node to clean CI (#901)
    • [ros2] Disable test_node to clean CI
    • uncrustify
  • [ros2] Port time commands (pause / reset) (#866)
  • [ros2] World plugin to get/set entity state services (#839) remove status_message
  • Fix Windows conflicting macros and missing usleep (#885)
    • Fix conflicting Windows macros and missing usleep
    • fix spacing
    • fix spacing again
    • remove lint
  • Call rclcpp::init() only from gazebo_ros_init (#859)
  • [ros] Revert sim time test (#853)
  • Contributors: Jonathan Noyola, Tamaki Nishino, chapulina

3.1.0 (2018-12-10)

  • [ros2] Camera and triggered camera (#827)
    • move gazebo_ros_camera and some functionality from gazebo_ros_camera_utils, needs master branch of image_transport and message_filters, not functional, but compiling
    • port PutCameraData, needs common_interfaces PR #58
    • move camera worlds, fix compilation, image can be seen on RViz
    • Port camera test: simplify world, use ServerFixture for better control and not to need launch - test is hanging on exit, not sure why
    • fix test hanging on exit
    • port camera16bit test and fix world copying on make
    • Start porting camera distortion tests: must port cam_info, 2nd test failing
    • sortout camera_name and frame_name
    • Port gazebo_ros_camera_triggered as part of gazebo_ros_camera, with test
    • Use camera_info_manager from branch ci_manager_port_louise, enable barrel distortion test - passes but segfaults at teardown, could be a problem with having 2 plugins side-by-side.
    • linters and comment out crashing test
    • Demo worlds, doxygen, more node tests
    • Use image_transport remapping
    • adapt to new image_transport pointer API
    • new API
  • fix rclcpp::init when there are no arguments
  • [ros2] Adapt sim time test to work around rclcpp issue
  • Contributors: Louise Poubel, chapulina

3.0.0 (2018-12-07)

  • [ros2] Port spawn/delete methods (#808)
    • First port of ROS2 of factory method. Still a work in progress
    • Install gazebo_ros_factory
    • Changes proposed by uncrustify
    • Make cpplint happy
    • Remove unneded header
    • fix merge
    • remove ported ROS 1 code
    • SpawnEntity service, initialize after world is created, remove XML strip since it\'s not needed, simplify Is* functions
    • support robot_namespace inside <plugin><ros><namespace>
    • a bit more tweaks and cleanup
    • Use libsdformat to parse the XML, instead of tinyxml, significantly reducing the code
    • uncrustify
    • port delete services
    • linters
    • spawn and delete tests, must check light test
    • fix spawning lights, compile error for non implemented conversions, linters
  • [ros2] Port diff_drive plugin to ros2 (#806)

    • copy gazebo_ros_diff_drive files from unported
    • Fix copy and paste error for exporting gazebo_ros_joint_state_publisher
    • Add gazebo_ros_diff_drive to CMakeLists.txt

    * Basic structures updated includes updated include guards updated CMake rules added Not compiling yet * starting deboostifying updating lock header passing compile diff drive plugin compiling clear all references to callback queue - pimpl, remove joint state publisher - documentation, add TF publishers - commands and publishers work, but visualization on RViz is jerky, must check - pass linters - check that reset works now, rename params, add missing package - remap topics, add pub/sub test - sleep longer to see if it passes on Jenkins

  • Remove node_name from <ros> SDF tag (#804)

    • Rename Node::Create to Node::Get
    • Node::Get without node name
    • Remove node_name support from SDF
    • wip get name from plugin name
    • Remove node name argument (will be inferred from sdf)
    • fix tests and implement static shared node
    • Adding test file
  • [ros2] Split conversions into headers specific to message packages (#803)

    • Tests depend on sensor_msgs
    • Move conversions to different headers to minimise deps brought in
    • Remove conversions namespace
    • Include updates

    * Update message package dependencies gazebo_ros doesn\'t need sensor_msgs or geometry_msgs anymore - Export msg pacakges so downstream packages depend - Include msg headers used directly - removing redundant dependencies - fix build and cpplint

  • working demo, notes and warnings about issues

  • fix build by adding includes

  • Test correctness of ray_sensor intensity

  • Add Point32->ign vector conversion, fix pointcloud conversion

  • Simplify ray_sensor using gazebo_ros conversions

  • Add LaserScan conversions to gazebo_ros

  • [ros2] Add clock publisher to gazebo_ros_init for use_sim_time support (#794)

    • Add Throttler to gazebo_ros utilities
    • Add sim time to gazebo_ros_init
    • Remove period constructor from Throttler
    • Improve sim time test
    • Fix compilation in isolation for gazebo_ros_init
    • Transient local durability for clock publisher
    • Linter fixup
    • Document Throttler will return true on first call
    • Store rate as double not Time
    • Import order improvements
  • [ros2] Port gazebo_ros_imu_sensor (#793)

    • Move files to prepare for imu_sensor ROS2 port
    • Port gazebo_ros_imu_sensor
    • Address IMU Sensor PR comments
    • Remove empty <imu> tag
    • document that always_on is required
    • alphabetical order includes
    • Step far forward instead of multiple small steps
    • Fix test_conversions not finding quaternion.hpp
    • Apply force longer; check IMU values; robust to negative linear accel
    • linter fixup
  • [ros2] gazebo_ros_joint_state_publisher (#795)

    • Port joint_state_publisher, copyright failing checker, still need to add a test
    • Fix copyright
    • Tests for joint state publisher
    • cleanup
    • depend on sensor_msgs
    • Use node\'s logger
  • Merge pull request #796 from ros-simulation/ros2_fix_ci_authors [ros2] Fix missing dependencies to run CI and update maintainers

  • Missing dependency in gazebo_ros

  • Add SensorFrameID utility function

  • Add NoiseVariance method for NoisePtr type

  • Add geometry quaternion -> ignition conversion

  • PR Comments for gazebo_ros utils

  • Add gazebo_ros utils for utility functions

  • Add time and quaternion conversions

  • Add testing_utils to reduce duplicate code in tests

  • PR feedback

  • conversions

  • improve example, add demo world, fix sdf warnings

  • Add Node::Create with sdf element Move ament linting back to main CmakeList Various style fixes Only catch RCL_NOT_INIT exception in Node::Create Add larger timeouts to tests (stil flakey)

  • [ros2] gazebo_ros_init plugin (#776) gazebo_ros_init plugin and very basic launch file

  • Fix bug in test_plugins not ensuring all topics were received

  • Call init from node in case it hasn\'t been called yet

  • Remove internal logic to check init, add more tests

  • Remove Node::Create using sdf until it is implemented

  • Add simple test for gazebo_ros::Node

  • Enable linters and make them happy

  • Create base Node class for gazebo plugins with ROS2

  • Move gazebo_ros files for porting

  • Contributors: Jose Luis Rivero, Kevin Allen, Louise Poubel, Tully Foote, chapulina, dhood

2.8.4 (2018-07-06)

  • Refactor spawn_model script
    • more robust -package_to_model implementation (issue #449)
    • add stdin as source option
    • parse arguments with argparse
    • remove deprecated/unused -gazebo and -trimesh options
  • Fix physics reconfigure within namespace (issue #507)
  • Contributors: Kevin Allen, Steven Peters

2.8.3 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (melodic-devel) (#724)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • Contributors: Jose Luis Rivero

2.8.2 (2018-05-09)

  • Fix the build on Ubuntu Artful. (#715) Artful has some bugs in its cmake files for Simbody that cause it to fail the build. If we are on artful, remove the problematic entries. Signed-off-by: Chris Lalancette <clalancette@openrobotics.org>
  • Contributors: Chris Lalancette

2.8.1 (2018-05-05)

  • Parameter to disable ROS network interaction from/to Gazebo (lunar-devel) (#704)
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS. (#676)
  • Pass verbose argument to gzclient (#677)
  • strip comments from parsed urdf (#698) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Contributors: Jose Luis Rivero

2.7.4 (2018-02-12)

  • Fix last gazebo8 warnings! (lunar-devel) (#664)
  • Fix for relative frame errors (lunar-devel) (#663)
  • Fix gazebo8 warnings part 7: retry #642 on lunar (#660)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (lunar-devel) (#657)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#655)
  • [gazebo_ros] don\'t overwrite parameter \"use_sim_time\" (lunar-devel) (#607)
  • Fix gazebo8 warnings part 8: ifdef\'s for GetWorldPose (lunar-devel) (#652)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#649)
  • for gazebo8+, call functions without Get (#640)
  • Contributors: Jose Luis Rivero, Steven Peters

2.7.3 (2017-12-11)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#627)
  • Fix gazebo8 warnings part 5: ignition math in gazebo_ros (lunar-devel) (#636)
  • Fix gazebo8 warnings part 4: convert remaining local variables in plugins to ign-math (lunar-devel) (#634)
  • gazebo_ros: fix support for python3 (#629)
  • Replace Events::Disconnect* with pointer reset (#626)
  • Install spawn_model using catkin_install_python (#624)
  • Quote arguments to echo in libcommon.sh (#591)
  • Contributors: Jose Luis Rivero

2.7.2 (2017-05-21)

  • Revert gazebo8 changes in Lunar and back to use gazebo7 (#583)
  • Contributors: Jose Luis Rivero

2.7.1 (2017-04-28)

  • Fixes for compilation and warnings in Lunar-devel (#573) Multiple fixes for compilation and warnings coming from Gazebo8 and ignition-math3
  • Add catkin package(s) to provide the default version of Gazebo - take II (kinetic-devel) (#571)
  • Contributors: Jose Luis Rivero

2.5.12 (2017-04-25)

2.5.11 (2017-04-18)

  • Changed the spawn model methods to spawn also lights. (#511)
  • Change build system to set DEPEND on Gazebo/SDFormat (fix catkin warning) Added missing DEPEND clauses to catkin_package to fix gazebo catkin warning. Note that after the change problems could appear related to -lpthreads errors. This is an known issue related to catkin: https://github.com/ros/catkin/issues/856.
  • Use correct logerr method (#557)
  • Contributors: Alessandro Ambrosano, Dave Coleman, Gary Servin

2.5.10 (2017-03-03)

  • Revert catkin warnings to fix regressions (problems with catkin -lpthreads errors) For reference and reasons, please check: https://discourse.ros.org/t/need-to-sync-new-release-of-rqt-topic-indigo-jade-kinetic/1410/4 * Revert \"Fix gazebo catkin warning, cleanup CMakeLists (#537)\" This reverts commit 5a0305fcb97864b66bc2e587fc0564435b4f2034. * Revert \"Fix gazebo and sdformat catkin warnings\" This reverts commit 11f95d25dcd32faccd2401d45c722f7794c7542c.

  • Contributors: Jose Luis Rivero

2.5.9 (2017-02-20)

  • Fix gazebo catkin warning, cleanup CMakeLists (#537)
  • Namespace console output (#543)
  • Removed all trailing whitespace
  • Contributors: Dave Coleman

2.5.8 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remapping by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Fixed getlinkstate service\'s angular velocity return
  • Honor GAZEBO_MASTER_URI in gzserver and gzclient
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, Martin Pecka

2.5.7 (2016-06-10)

2.5.6 (2016-04-28)

  • Remove deprecated spawn_gazebo_model service
  • Contributors: Steven Peters

2.5.5 (2016-04-27)

  • merge indigo, jade to kinetic-devel
  • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • disable gazebo_ros_control until dependencies are met
    • Remove stray backslash
  • spawn_model: adding -b option to bond to the model and delete it on sigint
  • Update maintainer for Kinetic release
  • Allow respawning gazebo node.
  • Contributors: Hugo Boyer, Isaac IY Saito, Jackie Kay, Jonathan Bohren, Jose Luis Rivero, Steven Peters

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Aguero, John Hsu, Jose Luis Rivero, Nate Koenig, Steven Peters, hsu, osrf

2.4.5 (2014-08-18)

  • Port fix_build branch for indigo-devel See pull request #221
  • Contributors: Jose Luis Rivero

2.4.4 (2014-07-18)

  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Vincenzo Comito

2.4.3 (2014-05-12)

  • added osx support for gazebo start scripts
  • Remove gazebo_ros dependency on gazebo_plugins
  • Contributors: Markus Achtelik, Steven Peters

2.4.2 (2014-03-27)

  • merging from hydro-devel
  • bump patch version for indigo-devel to 2.4.1
  • merging from indigo-devel after 2.3.4 release
  • \"2.4.0\"
  • catkin_generate_changelog
  • Contributors: John Hsu

2.4.1 (2013-11-13)

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • rerelease because sdformat became libsdformat, but we also based change on 2.3.4 in hydro-devel.
  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.4.0 (2013-10-14)

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.4.4
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version eloquent
Last Updated 2020-09-22
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.4.4 (2020-05-08)

  • wait for service with variable timeout (#1090)
  • Contributors: Karsten Knese, Louise Poubel

3.4.3 (2020-02-18)

  • [backport][ros2] make transient local reliable (#1033) (#1036)

    • [ros2] make transient local reliable (#1033)

    * make transient local reliable Signed-off-by: Karsten Knese <karsten@openrobotics.org> * fix master Signed-off-by: Karsten Knese <karsten@openrobotics.org> * add launch test Signed-off-by: Karsten Knese <karsten@openrobotics.org> * make it actual latched Signed-off-by: Karsten Knese <karsten@openrobotics.org> * alpha sort Signed-off-by: Karsten Knese <karsten@openrobotics.org> * add launch_test dependency Signed-off-by: Karsten Knese <karsten@openrobotics.org> * more dependencies Signed-off-by: Karsten Knese <karsten@openrobotics.org> * remove debug print Signed-off-by: Karsten Knese <karsten@openrobotics.org> * is_initialized -> ok Signed-off-by: Karsten Knese <karsten@openrobotics.org> * Update gazebo_ros/test/entity_spawner.test.py Co-Authored-By: chapulina <louise@openrobotics.org> * use erase-remove idiom Signed-off-by: Karsten Knese <karsten@openrobotics.org> * use ReadyToTest() Signed-off-by: Karsten Knese <karsten@openrobotics.org> Co-authored-by: chapulina <louise@openrobotics.org> * Set timeout and call gzserver directly Signed-off-by: Louise Poubel <louise@openrobotics.org> Co-authored-by: chapulina <louise@openrobotics.org>

  • fix pathsep for windows (#1028)

  • Remove ROS-specific arguments before passing to argparse (#994) This resolves argparse errors when trying to launch the spawn_entity script as a ROS node. For example, a launch file like the following wouldn\'t work without this change: <launch> <arg name=\"model_urdf\" default=\"\$(find-pkg-share mymodels)/urdf/ball.urdf\" /> <node pkg=\"gazebo_ros\" exec=\"spawn_entity.py\" name=\"spawner\" args=\"-entity foo -file /path/to/my/model/foo.urdf\" /> </launch> Signed-off-by: Jacob Perron <jacob@openrobotics.org>

  • [ros2] Remove ported / deprecated (#989) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • linter :sweat_smile: Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) (#986) * Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) Instead of waiting for a shutdown callback to be created in rclpy, we can use the try/except to get the SIGINT signal, then delete the entity. * Message formatting Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Conditional launch includes (#979) * [ros2] Conditional launch includes Signed-off-by: Louise Poubel <louise@openrobotics.org> * remove unused import Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Add maintainer (#985) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Address reviews on #868 (#972) * [ros2] World plugin to get/set entity state services (#839) remove status_message

    • [ros2] Port time commands (pause / reset) (#866)
    • [ros2] Migration of get/set world, model, joint, link, light properties
    • Trying to pass CI test, try n1.
    • clean up some linter warnings
    • Requested changes in review, unfinished
    • Fix uncrustify
    • Address reviews

    * more tests, joint types Signed-off-by: Louise Poubel <louise@openrobotics.org> * Revert changes to GetModelProperties message Document gazebo_ros_properties header * Convert msgs pose to math pose and use it on SetCoG Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Spawn <plugin> without <ros> (#983) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port spawn model to ROS2 (#948)

    • [ros2] Port spawn model to ROS2
    • Delete .ros1_unported files

    * Fixes and add demo Change spawn_model to spawn_entity - Rename demo launch and add checks for service - Fix reading xml file from param and model states

    * remove diplicate Signed-off-by: Louise Poubel <louise@openrobotics.org> - Use gazebo launch file - Change topic behaviour

  • [ros2] Port gazebo launch scripts to ROS2 (#962)

    • [ros2] Port gazebo launch scripts to ROS2
    • Add gdb and valgrind option
    • Use shell command for extra gazebo args
  • [ros2] Port joint pose trajectory to ROS2 (#955)

    • [ros2] Port joint pose trajectory to ROS2

    * Add conversion tests Minor fixes

  • Merge pull request #977 from ros-simulation/backport [backport] ros2 -> dashing

  • [ros2] Port Link states to ROS2 (#969)

    • [ros2] Port model states to ROS2
    • [ros2] Port link states to ROS2
    • Change usage of body -> link
    • Remove link_states from .ros1_unported
  • set gazebo library dirs (#963) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • [ros2] Port gazebo_ros_path plugin to ROS2 (#925)

    • [ros2] Port gazebo_ros_path plugin
    • Minor fixes
    • Change plugin launch file to python script
    • Fix for flake8 test
  • [ros2] Port bumper sensor to ROS2 (#943)

    • [ros2] Port bumper sensor to ROS2
    • Add author name
    • Minor fixes and add contact msg conversion
    • Remove unused header includes
  • [ros2] Fix tests on Dashing (#953) * [ros2] Fix camera triggered test on Dashing backport remove noe fix and re-enable distortion tests * improve robustness of joint state pub test Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port model states to ROS2 (#968)

    • [ros2] Port model states to ROS2

    * remove unported code Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port hand of god to ROS2 (#957)

    • [ros2] Port hand of god to ROS2
    • Minor fixes
  • [ros2] Port planar move to ROS2 (#958)

    • [ros2] Port planar move to ROS2
    • Add test for pose conversion
  • use c_str() (#950) (#954) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • Contributors: Jacob Perron, Jonathan Noyola, Karsten Knese, Louise Poubel, Shivesh Khaitan, alexfneves, chapulina

3.4.2 (2019-11-12)

  • Merge branch \'ros2\' into eloquent
  • Remove ROS-specific arguments before passing to argparse (#994) (#1013) This resolves argparse errors when trying to launch the spawn_entity script as a ROS node. For example, a launch file like the following wouldn\'t work without this change: <launch> <arg name=\"model_urdf\" default=\"\$(find-pkg-share mymodels)/urdf/ball.urdf\" /> <node pkg=\"gazebo_ros\" exec=\"spawn_entity.py\" name=\"spawner\" args=\"-entity foo -file /path/to/my/model/foo.urdf\" /> </launch> Signed-off-by: Jacob Perron <jacob@openrobotics.org>
  • [ros2] Add remapping tag (#1011) * add --ros-args and a remapping element for ros arguments Signed-off-by: Mikael Arguedas <mikael.arguedas@gmail.com> * keep backward compatibility Signed-off-by: Mikael Arguedas <mikael.arguedas@gmail.com> * update docs and world file accordingly Signed-off-by: Mikael Arguedas <mikael.arguedas@gmail.com> * remap all the things :fist_raised: Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • catch const ref to fix -Wcatch-value warnings (#1012) Signed-off-by: Mikael Arguedas <mikael.arguedas@gmail.com>

  • Contributors: Jacob Perron, Louise Poubel, Mikael Arguedas

3.4.1 (2019-10-10)

3.4.0 (2019-10-03)

  • [ros2] Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) (#986) * Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Conditional launch includes (#979) * remove unused import Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Add maintainer (#985) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Spawn <plugin> without <ros> (#983) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Merge pull request #980 from shiveshkhaitan/forward_port [forward_port] dashing -> ros2

  • [ros2] Port spawn model to ROS2 (#948) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port gazebo launch scripts to ROS2 (#962)

  • [ros2] Port joint pose trajectory to ROS2 (#955)

  • [ros2] Port Link states to ROS2 (#969)

  • [ros2] Fix tests on Dashing (#953) * [ros2] Fix camera triggered test on Dashing Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port model states to ROS2 (#968) * [ros2] Port model states to ROS2 Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port hand of god to ROS2 (#957)

  • [ros2] Port planar move to ROS2 (#958)

  • [ros2] Port apply/clear wrench and effort services (#941)

  • [ros2] Port gazebo_ros_path plugin to ROS2 (#925)

  • set gazebo library dirs (#963) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • [ros2] Port bumper sensor to ROS2 (#943)

  • Fix for multiple video plugins (#898) (#937)

  • use c_str() (#950) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • Crystal changes for dashing (#933)

    • [ros2] World plugin to get/set entity state services (#839)
    • [ros2] Port time commands (pause / reset) (#866)
    • relative -> reference
  • Contributors: Karsten Knese, Louise Poubel, Shivesh Khaitan, alexfneves, chapulina

3.3.5 (2020-05-08)

  • fix pathsep for windows (#1028)
  • Contributors: Jonathan Noyola

3.3.4 (2019-09-18)

  • Remove ROS-specific arguments before passing to argparse (#994) This resolves argparse errors when trying to launch the spawn_entity script as a ROS node. For example, a launch file like the following wouldn\'t work without this change: <launch> <arg name=\"model_urdf\" default=\"\$(find-pkg-share mymodels)/urdf/ball.urdf\" /> <node pkg=\"gazebo_ros\" exec=\"spawn_entity.py\" name=\"spawner\" args=\"-entity foo -file /path/to/my/model/foo.urdf\" /> </launch> Signed-off-by: Jacob Perron <jacob@openrobotics.org>
  • [ros2] Remove ported / deprecated (#989) Signed-off-by: Louise Poubel <louise@openrobotics.org>
  • linter :sweat_smile: Signed-off-by: Louise Poubel <louise@openrobotics.org>
  • [ros2] Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) (#986) * Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) Instead of waiting for a shutdown callback to be created in rclpy, we can use the try/except to get the SIGINT signal, then delete the entity. * Message formatting Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Contributors: Jacob Perron, Louise Poubel, alexfneves, chapulina

3.3.3 (2019-08-23)

  • [ros2] Conditional launch includes (#979) * [ros2] Conditional launch includes Signed-off-by: Louise Poubel <louise@openrobotics.org> * remove unused import Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Add maintainer (#985) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Address reviews on #868 (#972) * [ros2] World plugin to get/set entity state services (#839) remove status_message

    • [ros2] Port time commands (pause / reset) (#866)
    • [ros2] Migration of get/set world, model, joint, link, light properties
    • Trying to pass CI test, try n1.
    • clean up some linter warnings
    • Requested changes in review, unfinished
    • Fix uncrustify
    • Address reviews

    * more tests, joint types Signed-off-by: Louise Poubel <louise@openrobotics.org> * Revert changes to GetModelProperties message Document gazebo_ros_properties header * Convert msgs pose to math pose and use it on SetCoG Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Spawn <plugin> without <ros> (#983) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port spawn model to ROS2 (#948)

    • [ros2] Port spawn model to ROS2
    • Delete .ros1_unported files

    * Fixes and add demo Change spawn_model to spawn_entity - Rename demo launch and add checks for service - Fix reading xml file from param and model states

    * remove diplicate Signed-off-by: Louise Poubel <louise@openrobotics.org> - Use gazebo launch file - Change topic behaviour

  • [ros2] Port gazebo launch scripts to ROS2 (#962)

    • [ros2] Port gazebo launch scripts to ROS2
    • Add gdb and valgrind option
    • Use shell command for extra gazebo args
  • [ros2] Port joint pose trajectory to ROS2 (#955)

    • [ros2] Port joint pose trajectory to ROS2

    * Add conversion tests Minor fixes

  • Merge pull request #977 from ros-simulation/backport [backport] ros2 -> dashing

  • [ros2] Port Link states to ROS2 (#969)

    • [ros2] Port model states to ROS2
    • [ros2] Port link states to ROS2
    • Change usage of body -> link
    • Remove link_states from .ros1_unported
  • set gazebo library dirs (#963) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • [ros2] Port gazebo_ros_path plugin to ROS2 (#925)

    • [ros2] Port gazebo_ros_path plugin
    • Minor fixes
    • Change plugin launch file to python script
    • Fix for flake8 test
  • [ros2] Port bumper sensor to ROS2 (#943)

    • [ros2] Port bumper sensor to ROS2
    • Add author name
    • Minor fixes and add contact msg conversion
    • Remove unused header includes
  • [ros2] Fix tests on Dashing (#953) * [ros2] Fix camera triggered test on Dashing backport remove noe fix and re-enable distortion tests * improve robustness of joint state pub test Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port model states to ROS2 (#968)

    • [ros2] Port model states to ROS2

    * remove unported code Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port hand of god to ROS2 (#957)

    • [ros2] Port hand of god to ROS2
    • Minor fixes
  • Contributors: Karsten Knese, Shivesh Khaitan, chapulina

3.3.2 (2019-07-31)

  • [ros2] Port planar move to ROS2 (#958)
    • [ros2] Port planar move to ROS2
    • Add test for pose conversion
  • use c_str() (#950) (#954) Signed-off-by: Karsten Knese <karsten@openrobotics.org>
  • Crystal changes for dashing (#933) * [ros2] World plugin to get/set entity state services (#839) remove status_message

    • [ros2] Port time commands (pause / reset) (#866)
    • relative -> reference
  • Contributors: Shivesh Khaitan, chapulina

3.3.1 (2019-05-30)

  • Declare parameters and use overrides (#931)
    • Declare parameters and use overrides
    • PR feedback
    • fix linking error
  • Contributors: chapulina

3.3.0 (2019-05-21)

  • use latest dashing api (#926) * [gazebo_ros] use qos Signed-off-by: Karsten Knese <karsten@openrobotics.org> * [gazebo_ros] avoid unused warning Signed-off-by: Karsten Knese <karsten@openrobotics.org> * [gazebo_plugins] use qos Signed-off-by: Karsten Knese <karsten@openrobotics.org>

    • allow_undeclared_parameters
    • fix tests
    • forward port pull request #901
  • Fix build to account for new NodeOptions interface. (#887)

  • Fix Windows conflicting macros and missing usleep (#885)

    • Fix conflicting Windows macros and missing usleep
    • fix spacing
    • fix spacing again
    • remove lint
  • Call rclcpp::init() only from gazebo_ros_init (#859)

  • [ros] Revert sim time test (#853)

  • Contributors: Carl Delsey, Jonathan Noyola, Karsten Knese, Tamaki Nishino, chapulina

3.1.0 (2018-12-10)

  • [ros2] Camera and triggered camera (#827)
    • move gazebo_ros_camera and some functionality from gazebo_ros_camera_utils, needs master branch of image_transport and message_filters, not functional, but compiling
    • port PutCameraData, needs common_interfaces PR #58
    • move camera worlds, fix compilation, image can be seen on RViz
    • Port camera test: simplify world, use ServerFixture for better control and not to need launch - test is hanging on exit, not sure why
    • fix test hanging on exit
    • port camera16bit test and fix world copying on make
    • Start porting camera distortion tests: must port cam_info, 2nd test failing
    • sortout camera_name and frame_name
    • Port gazebo_ros_camera_triggered as part of gazebo_ros_camera, with test
    • Use camera_info_manager from branch ci_manager_port_louise, enable barrel distortion test - passes but segfaults at teardown, could be a problem with having 2 plugins side-by-side.
    • linters and comment out crashing test
    • Demo worlds, doxygen, more node tests
    • Use image_transport remapping
    • adapt to new image_transport pointer API
    • new API
  • fix rclcpp::init when there are no arguments
  • [ros2] Adapt sim time test to work around rclcpp issue
  • Contributors: Louise Poubel, chapulina

3.0.0 (2018-12-07)

  • [ros2] Port spawn/delete methods (#808)
    • First port of ROS2 of factory method. Still a work in progress
    • Install gazebo_ros_factory
    • Changes proposed by uncrustify
    • Make cpplint happy
    • Remove unneded header
    • fix merge
    • remove ported ROS 1 code
    • SpawnEntity service, initialize after world is created, remove XML strip since it\'s not needed, simplify Is* functions
    • support robot_namespace inside <plugin><ros><namespace>
    • a bit more tweaks and cleanup
    • Use libsdformat to parse the XML, instead of tinyxml, significantly reducing the code
    • uncrustify
    • port delete services
    • linters
    • spawn and delete tests, must check light test
    • fix spawning lights, compile error for non implemented conversions, linters
  • [ros2] Port diff_drive plugin to ros2 (#806)

    • copy gazebo_ros_diff_drive files from unported
    • Fix copy and paste error for exporting gazebo_ros_joint_state_publisher
    • Add gazebo_ros_diff_drive to CMakeLists.txt

    * Basic structures updated includes updated include guards updated CMake rules added Not compiling yet * starting deboostifying updating lock header passing compile diff drive plugin compiling clear all references to callback queue - pimpl, remove joint state publisher - documentation, add TF publishers - commands and publishers work, but visualization on RViz is jerky, must check - pass linters - check that reset works now, rename params, add missing package - remap topics, add pub/sub test - sleep longer to see if it passes on Jenkins

  • Remove node_name from <ros> SDF tag (#804)

    • Rename Node::Create to Node::Get
    • Node::Get without node name
    • Remove node_name support from SDF
    • wip get name from plugin name
    • Remove node name argument (will be inferred from sdf)
    • fix tests and implement static shared node
    • Adding test file
  • [ros2] Split conversions into headers specific to message packages (#803)

    • Tests depend on sensor_msgs
    • Move conversions to different headers to minimise deps brought in
    • Remove conversions namespace
    • Include updates

    * Update message package dependencies gazebo_ros doesn\'t need sensor_msgs or geometry_msgs anymore - Export msg pacakges so downstream packages depend - Include msg headers used directly - removing redundant dependencies - fix build and cpplint

  • working demo, notes and warnings about issues

  • fix build by adding includes

  • Test correctness of ray_sensor intensity

  • Add Point32->ign vector conversion, fix pointcloud conversion

  • Simplify ray_sensor using gazebo_ros conversions

  • Add LaserScan conversions to gazebo_ros

  • [ros2] Add clock publisher to gazebo_ros_init for use_sim_time support (#794)

    • Add Throttler to gazebo_ros utilities
    • Add sim time to gazebo_ros_init
    • Remove period constructor from Throttler
    • Improve sim time test
    • Fix compilation in isolation for gazebo_ros_init
    • Transient local durability for clock publisher
    • Linter fixup
    • Document Throttler will return true on first call
    • Store rate as double not Time
    • Import order improvements
  • [ros2] Port gazebo_ros_imu_sensor (#793)

    • Move files to prepare for imu_sensor ROS2 port
    • Port gazebo_ros_imu_sensor
    • Address IMU Sensor PR comments
    • Remove empty <imu> tag
    • document that always_on is required
    • alphabetical order includes
    • Step far forward instead of multiple small steps
    • Fix test_conversions not finding quaternion.hpp
    • Apply force longer; check IMU values; robust to negative linear accel
    • linter fixup
  • [ros2] gazebo_ros_joint_state_publisher (#795)

    • Port joint_state_publisher, copyright failing checker, still need to add a test
    • Fix copyright
    • Tests for joint state publisher
    • cleanup
    • depend on sensor_msgs
    • Use node\'s logger
  • Merge pull request #796 from ros-simulation/ros2_fix_ci_authors [ros2] Fix missing dependencies to run CI and update maintainers

  • Missing dependency in gazebo_ros

  • Add SensorFrameID utility function

  • Add NoiseVariance method for NoisePtr type

  • Add geometry quaternion -> ignition conversion

  • PR Comments for gazebo_ros utils

  • Add gazebo_ros utils for utility functions

  • Add time and quaternion conversions

  • Add testing_utils to reduce duplicate code in tests

  • PR feedback

  • conversions

  • improve example, add demo world, fix sdf warnings

  • Add Node::Create with sdf element Move ament linting back to main CmakeList Various style fixes Only catch RCL_NOT_INIT exception in Node::Create Add larger timeouts to tests (stil flakey)

  • [ros2] gazebo_ros_init plugin (#776) gazebo_ros_init plugin and very basic launch file

  • Fix bug in test_plugins not ensuring all topics were received

  • Call init from node in case it hasn\'t been called yet

  • Remove internal logic to check init, add more tests

  • Remove Node::Create using sdf until it is implemented

  • Add simple test for gazebo_ros::Node

  • Enable linters and make them happy

  • Create base Node class for gazebo plugins with ROS2

  • Move gazebo_ros files for porting

  • Contributors: Jose Luis Rivero, Kevin Allen, Louise Poubel, Tully Foote, chapulina, dhood

2.8.4 (2018-07-06)

  • Refactor spawn_model script
    • more robust -package_to_model implementation (issue #449)
    • add stdin as source option
    • parse arguments with argparse
    • remove deprecated/unused -gazebo and -trimesh options
  • Fix physics reconfigure within namespace (issue #507)
  • Contributors: Kevin Allen, Steven Peters

2.8.3 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (melodic-devel) (#724)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • Contributors: Jose Luis Rivero

2.8.2 (2018-05-09)

  • Fix the build on Ubuntu Artful. (#715) Artful has some bugs in its cmake files for Simbody that cause it to fail the build. If we are on artful, remove the problematic entries. Signed-off-by: Chris Lalancette <clalancette@openrobotics.org>
  • Contributors: Chris Lalancette

2.8.1 (2018-05-05)

  • Parameter to disable ROS network interaction from/to Gazebo (lunar-devel) (#704)
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS. (#676)
  • Pass verbose argument to gzclient (#677)
  • strip comments from parsed urdf (#698) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Contributors: Jose Luis Rivero

2.7.4 (2018-02-12)

  • Fix last gazebo8 warnings! (lunar-devel) (#664)
  • Fix for relative frame errors (lunar-devel) (#663)
  • Fix gazebo8 warnings part 7: retry #642 on lunar (#660)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (lunar-devel) (#657)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#655)
  • [gazebo_ros] don\'t overwrite parameter \"use_sim_time\" (lunar-devel) (#607)
  • Fix gazebo8 warnings part 8: ifdef\'s for GetWorldPose (lunar-devel) (#652)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#649)
  • for gazebo8+, call functions without Get (#640)
  • Contributors: Jose Luis Rivero, Steven Peters

2.7.3 (2017-12-11)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#627)
  • Fix gazebo8 warnings part 5: ignition math in gazebo_ros (lunar-devel) (#636)
  • Fix gazebo8 warnings part 4: convert remaining local variables in plugins to ign-math (lunar-devel) (#634)
  • gazebo_ros: fix support for python3 (#629)
  • Replace Events::Disconnect* with pointer reset (#626)
  • Install spawn_model using catkin_install_python (#624)
  • Quote arguments to echo in libcommon.sh (#591)
  • Contributors: Jose Luis Rivero

2.7.2 (2017-05-21)

  • Revert gazebo8 changes in Lunar and back to use gazebo7 (#583)
  • Contributors: Jose Luis Rivero

2.7.1 (2017-04-28)

  • Fixes for compilation and warnings in Lunar-devel (#573) Multiple fixes for compilation and warnings coming from Gazebo8 and ignition-math3
  • Add catkin package(s) to provide the default version of Gazebo - take II (kinetic-devel) (#571)
  • Contributors: Jose Luis Rivero

2.5.12 (2017-04-25)

2.5.11 (2017-04-18)

  • Changed the spawn model methods to spawn also lights. (#511)
  • Change build system to set DEPEND on Gazebo/SDFormat (fix catkin warning) Added missing DEPEND clauses to catkin_package to fix gazebo catkin warning. Note that after the change problems could appear related to -lpthreads errors. This is an known issue related to catkin: https://github.com/ros/catkin/issues/856.
  • Use correct logerr method (#557)
  • Contributors: Alessandro Ambrosano, Dave Coleman, Gary Servin

2.5.10 (2017-03-03)

  • Revert catkin warnings to fix regressions (problems with catkin -lpthreads errors) For reference and reasons, please check: https://discourse.ros.org/t/need-to-sync-new-release-of-rqt-topic-indigo-jade-kinetic/1410/4 * Revert \"Fix gazebo catkin warning, cleanup CMakeLists (#537)\" This reverts commit 5a0305fcb97864b66bc2e587fc0564435b4f2034. * Revert \"Fix gazebo and sdformat catkin warnings\" This reverts commit 11f95d25dcd32faccd2401d45c722f7794c7542c.

  • Contributors: Jose Luis Rivero

2.5.9 (2017-02-20)

  • Fix gazebo catkin warning, cleanup CMakeLists (#537)
  • Namespace console output (#543)
  • Removed all trailing whitespace
  • Contributors: Dave Coleman

2.5.8 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remapping by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Fixed getlinkstate service\'s angular velocity return
  • Honor GAZEBO_MASTER_URI in gzserver and gzclient
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, Martin Pecka

2.5.7 (2016-06-10)

2.5.6 (2016-04-28)

  • Remove deprecated spawn_gazebo_model service
  • Contributors: Steven Peters

2.5.5 (2016-04-27)

  • merge indigo, jade to kinetic-devel
  • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • disable gazebo_ros_control until dependencies are met
    • Remove stray backslash
  • spawn_model: adding -b option to bond to the model and delete it on sigint
  • Update maintainer for Kinetic release
  • Allow respawning gazebo node.
  • Contributors: Hugo Boyer, Isaac IY Saito, Jackie Kay, Jonathan Bohren, Jose Luis Rivero, Steven Peters

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Aguero, John Hsu, Jose Luis Rivero, Nate Koenig, Steven Peters, hsu, osrf

2.4.5 (2014-08-18)

  • Port fix_build branch for indigo-devel See pull request #221
  • Contributors: Jose Luis Rivero

2.4.4 (2014-07-18)

  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Vincenzo Comito

2.4.3 (2014-05-12)

  • added osx support for gazebo start scripts
  • Remove gazebo_ros dependency on gazebo_plugins
  • Contributors: Markus Achtelik, Steven Peters

2.4.2 (2014-03-27)

  • merging from hydro-devel
  • bump patch version for indigo-devel to 2.4.1
  • merging from indigo-devel after 2.3.4 release
  • \"2.4.0\"
  • catkin_generate_changelog
  • Contributors: John Hsu

2.4.1 (2013-11-13)

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • rerelease because sdformat became libsdformat, but we also based change on 2.3.4 in hydro-devel.
  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.4.0 (2013-10-14)

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.3.5
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version dashing
Last Updated 2021-01-06
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.3.5 (2020-05-08)

  • fix pathsep for windows (#1028)
  • Contributors: Jonathan Noyola

3.3.4 (2019-09-18)

  • Remove ROS-specific arguments before passing to argparse (#994) This resolves argparse errors when trying to launch the spawn_entity script as a ROS node. For example, a launch file like the following wouldn\'t work without this change: <launch> <arg name=\"model_urdf\" default=\"\$(find-pkg-share mymodels)/urdf/ball.urdf\" /> <node pkg=\"gazebo_ros\" exec=\"spawn_entity.py\" name=\"spawner\" args=\"-entity foo -file /path/to/my/model/foo.urdf\" /> </launch> Signed-off-by: Jacob Perron <jacob@openrobotics.org>
  • [ros2] Remove ported / deprecated (#989) Signed-off-by: Louise Poubel <louise@openrobotics.org>
  • linter :sweat_smile: Signed-off-by: Louise Poubel <louise@openrobotics.org>
  • [ros2] Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) (#986) * Uncommenting bond option on spawn_entity (wait Ctrl+C then remove entity) Instead of waiting for a shutdown callback to be created in rclpy, we can use the try/except to get the SIGINT signal, then delete the entity. * Message formatting Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Contributors: Jacob Perron, Louise Poubel, alexfneves, chapulina

3.3.3 (2019-08-23)

  • [ros2] Conditional launch includes (#979) * [ros2] Conditional launch includes Signed-off-by: Louise Poubel <louise@openrobotics.org> * remove unused import Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Add maintainer (#985) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Address reviews on #868 (#972) * [ros2] World plugin to get/set entity state services (#839) remove status_message

    • [ros2] Port time commands (pause / reset) (#866)
    • [ros2] Migration of get/set world, model, joint, link, light properties
    • Trying to pass CI test, try n1.
    • clean up some linter warnings
    • Requested changes in review, unfinished
    • Fix uncrustify
    • Address reviews

    * more tests, joint types Signed-off-by: Louise Poubel <louise@openrobotics.org> * Revert changes to GetModelProperties message Document gazebo_ros_properties header * Convert msgs pose to math pose and use it on SetCoG Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Spawn <plugin> without <ros> (#983) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port spawn model to ROS2 (#948)

    • [ros2] Port spawn model to ROS2
    • Delete .ros1_unported files

    * Fixes and add demo Change spawn_model to spawn_entity - Rename demo launch and add checks for service - Fix reading xml file from param and model states

    * remove diplicate Signed-off-by: Louise Poubel <louise@openrobotics.org> - Use gazebo launch file - Change topic behaviour

  • [ros2] Port gazebo launch scripts to ROS2 (#962)

    • [ros2] Port gazebo launch scripts to ROS2
    • Add gdb and valgrind option
    • Use shell command for extra gazebo args
  • [ros2] Port joint pose trajectory to ROS2 (#955)

    • [ros2] Port joint pose trajectory to ROS2

    * Add conversion tests Minor fixes

  • Merge pull request #977 from ros-simulation/backport [backport] ros2 -> dashing

  • [ros2] Port Link states to ROS2 (#969)

    • [ros2] Port model states to ROS2
    • [ros2] Port link states to ROS2
    • Change usage of body -> link
    • Remove link_states from .ros1_unported
  • set gazebo library dirs (#963) Signed-off-by: Karsten Knese <karsten@openrobotics.org>

  • [ros2] Port gazebo_ros_path plugin to ROS2 (#925)

    • [ros2] Port gazebo_ros_path plugin
    • Minor fixes
    • Change plugin launch file to python script
    • Fix for flake8 test
  • [ros2] Port bumper sensor to ROS2 (#943)

    • [ros2] Port bumper sensor to ROS2
    • Add author name
    • Minor fixes and add contact msg conversion
    • Remove unused header includes
  • [ros2] Fix tests on Dashing (#953) * [ros2] Fix camera triggered test on Dashing backport remove noe fix and re-enable distortion tests * improve robustness of joint state pub test Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port model states to ROS2 (#968)

    • [ros2] Port model states to ROS2

    * remove unported code Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] Port hand of god to ROS2 (#957)

    • [ros2] Port hand of god to ROS2
    • Minor fixes
  • Contributors: Karsten Knese, Shivesh Khaitan, chapulina

3.3.2 (2019-07-31)

  • [ros2] Port planar move to ROS2 (#958)
    • [ros2] Port planar move to ROS2
    • Add test for pose conversion
  • use c_str() (#950) (#954) Signed-off-by: Karsten Knese <karsten@openrobotics.org>
  • Crystal changes for dashing (#933) * [ros2] World plugin to get/set entity state services (#839) remove status_message

    • [ros2] Port time commands (pause / reset) (#866)
    • relative -> reference
  • Contributors: Shivesh Khaitan, chapulina

3.3.1 (2019-05-30)

  • Declare parameters and use overrides (#931)
    • Declare parameters and use overrides
    • PR feedback
    • fix linking error
  • Contributors: chapulina

3.3.0 (2019-05-21)

  • use latest dashing api (#926) * [gazebo_ros] use qos Signed-off-by: Karsten Knese <karsten@openrobotics.org> * [gazebo_ros] avoid unused warning Signed-off-by: Karsten Knese <karsten@openrobotics.org> * [gazebo_plugins] use qos Signed-off-by: Karsten Knese <karsten@openrobotics.org>

    • allow_undeclared_parameters
    • fix tests
    • forward port pull request #901
  • Fix build to account for new NodeOptions interface. (#887)

  • Fix Windows conflicting macros and missing usleep (#885)

    • Fix conflicting Windows macros and missing usleep
    • fix spacing
    • fix spacing again
    • remove lint
  • Call rclcpp::init() only from gazebo_ros_init (#859)

  • [ros] Revert sim time test (#853)

  • Contributors: Carl Delsey, Jonathan Noyola, Karsten Knese, Tamaki Nishino, chapulina

3.1.0 (2018-12-10)

  • [ros2] Camera and triggered camera (#827)
    • move gazebo_ros_camera and some functionality from gazebo_ros_camera_utils, needs master branch of image_transport and message_filters, not functional, but compiling
    • port PutCameraData, needs common_interfaces PR #58
    • move camera worlds, fix compilation, image can be seen on RViz
    • Port camera test: simplify world, use ServerFixture for better control and not to need launch - test is hanging on exit, not sure why
    • fix test hanging on exit
    • port camera16bit test and fix world copying on make
    • Start porting camera distortion tests: must port cam_info, 2nd test failing
    • sortout camera_name and frame_name
    • Port gazebo_ros_camera_triggered as part of gazebo_ros_camera, with test
    • Use camera_info_manager from branch ci_manager_port_louise, enable barrel distortion test - passes but segfaults at teardown, could be a problem with having 2 plugins side-by-side.
    • linters and comment out crashing test
    • Demo worlds, doxygen, more node tests
    • Use image_transport remapping
    • adapt to new image_transport pointer API
    • new API
  • fix rclcpp::init when there are no arguments
  • [ros2] Adapt sim time test to work around rclcpp issue
  • Contributors: Louise Poubel, chapulina

3.0.0 (2018-12-07)

  • [ros2] Port spawn/delete methods (#808)
    • First port of ROS2 of factory method. Still a work in progress
    • Install gazebo_ros_factory
    • Changes proposed by uncrustify
    • Make cpplint happy
    • Remove unneded header
    • fix merge
    • remove ported ROS 1 code
    • SpawnEntity service, initialize after world is created, remove XML strip since it\'s not needed, simplify Is* functions
    • support robot_namespace inside <plugin><ros><namespace>
    • a bit more tweaks and cleanup
    • Use libsdformat to parse the XML, instead of tinyxml, significantly reducing the code
    • uncrustify
    • port delete services
    • linters
    • spawn and delete tests, must check light test
    • fix spawning lights, compile error for non implemented conversions, linters
  • [ros2] Port diff_drive plugin to ros2 (#806)

    • copy gazebo_ros_diff_drive files from unported
    • Fix copy and paste error for exporting gazebo_ros_joint_state_publisher
    • Add gazebo_ros_diff_drive to CMakeLists.txt

    * Basic structures updated includes updated include guards updated CMake rules added Not compiling yet * starting deboostifying updating lock header passing compile diff drive plugin compiling clear all references to callback queue - pimpl, remove joint state publisher - documentation, add TF publishers - commands and publishers work, but visualization on RViz is jerky, must check - pass linters - check that reset works now, rename params, add missing package - remap topics, add pub/sub test - sleep longer to see if it passes on Jenkins

  • Remove node_name from <ros> SDF tag (#804)

    • Rename Node::Create to Node::Get
    • Node::Get without node name
    • Remove node_name support from SDF
    • wip get name from plugin name
    • Remove node name argument (will be inferred from sdf)
    • fix tests and implement static shared node
    • Adding test file
  • [ros2] Split conversions into headers specific to message packages (#803)

    • Tests depend on sensor_msgs
    • Move conversions to different headers to minimise deps brought in
    • Remove conversions namespace
    • Include updates

    * Update message package dependencies gazebo_ros doesn\'t need sensor_msgs or geometry_msgs anymore - Export msg pacakges so downstream packages depend - Include msg headers used directly - removing redundant dependencies - fix build and cpplint

  • working demo, notes and warnings about issues

  • fix build by adding includes

  • Test correctness of ray_sensor intensity

  • Add Point32->ign vector conversion, fix pointcloud conversion

  • Simplify ray_sensor using gazebo_ros conversions

  • Add LaserScan conversions to gazebo_ros

  • [ros2] Add clock publisher to gazebo_ros_init for use_sim_time support (#794)

    • Add Throttler to gazebo_ros utilities
    • Add sim time to gazebo_ros_init
    • Remove period constructor from Throttler
    • Improve sim time test
    • Fix compilation in isolation for gazebo_ros_init
    • Transient local durability for clock publisher
    • Linter fixup
    • Document Throttler will return true on first call
    • Store rate as double not Time
    • Import order improvements
  • [ros2] Port gazebo_ros_imu_sensor (#793)

    • Move files to prepare for imu_sensor ROS2 port
    • Port gazebo_ros_imu_sensor
    • Address IMU Sensor PR comments
    • Remove empty <imu> tag
    • document that always_on is required
    • alphabetical order includes
    • Step far forward instead of multiple small steps
    • Fix test_conversions not finding quaternion.hpp
    • Apply force longer; check IMU values; robust to negative linear accel
    • linter fixup
  • [ros2] gazebo_ros_joint_state_publisher (#795)

    • Port joint_state_publisher, copyright failing checker, still need to add a test
    • Fix copyright
    • Tests for joint state publisher
    • cleanup
    • depend on sensor_msgs
    • Use node\'s logger
  • Merge pull request #796 from ros-simulation/ros2_fix_ci_authors [ros2] Fix missing dependencies to run CI and update maintainers

  • Missing dependency in gazebo_ros

  • Add SensorFrameID utility function

  • Add NoiseVariance method for NoisePtr type

  • Add geometry quaternion -> ignition conversion

  • PR Comments for gazebo_ros utils

  • Add gazebo_ros utils for utility functions

  • Add time and quaternion conversions

  • Add testing_utils to reduce duplicate code in tests

  • PR feedback

  • conversions

  • improve example, add demo world, fix sdf warnings

  • Add Node::Create with sdf element Move ament linting back to main CmakeList Various style fixes Only catch RCL_NOT_INIT exception in Node::Create Add larger timeouts to tests (stil flakey)

  • [ros2] gazebo_ros_init plugin (#776) gazebo_ros_init plugin and very basic launch file

  • Fix bug in test_plugins not ensuring all topics were received

  • Call init from node in case it hasn\'t been called yet

  • Remove internal logic to check init, add more tests

  • Remove Node::Create using sdf until it is implemented

  • Add simple test for gazebo_ros::Node

  • Enable linters and make them happy

  • Create base Node class for gazebo plugins with ROS2

  • Move gazebo_ros files for porting

  • Contributors: Jose Luis Rivero, Kevin Allen, Louise Poubel, Tully Foote, chapulina, dhood

2.8.4 (2018-07-06)

  • Refactor spawn_model script
    • more robust -package_to_model implementation (issue #449)
    • add stdin as source option
    • parse arguments with argparse
    • remove deprecated/unused -gazebo and -trimesh options
  • Fix physics reconfigure within namespace (issue #507)
  • Contributors: Kevin Allen, Steven Peters

2.8.3 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (melodic-devel) (#724)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • Contributors: Jose Luis Rivero

2.8.2 (2018-05-09)

  • Fix the build on Ubuntu Artful. (#715) Artful has some bugs in its cmake files for Simbody that cause it to fail the build. If we are on artful, remove the problematic entries. Signed-off-by: Chris Lalancette <clalancette@openrobotics.org>
  • Contributors: Chris Lalancette

2.8.1 (2018-05-05)

  • Parameter to disable ROS network interaction from/to Gazebo (lunar-devel) (#704)
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS. (#676)
  • Pass verbose argument to gzclient (#677)
  • strip comments from parsed urdf (#698) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Contributors: Jose Luis Rivero

2.7.4 (2018-02-12)

  • Fix last gazebo8 warnings! (lunar-devel) (#664)
  • Fix for relative frame errors (lunar-devel) (#663)
  • Fix gazebo8 warnings part 7: retry #642 on lunar (#660)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (lunar-devel) (#657)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#655)
  • [gazebo_ros] don\'t overwrite parameter \"use_sim_time\" (lunar-devel) (#607)
  • Fix gazebo8 warnings part 8: ifdef\'s for GetWorldPose (lunar-devel) (#652)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#649)
  • for gazebo8+, call functions without Get (#640)
  • Contributors: Jose Luis Rivero, Steven Peters

2.7.3 (2017-12-11)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#627)
  • Fix gazebo8 warnings part 5: ignition math in gazebo_ros (lunar-devel) (#636)
  • Fix gazebo8 warnings part 4: convert remaining local variables in plugins to ign-math (lunar-devel) (#634)
  • gazebo_ros: fix support for python3 (#629)
  • Replace Events::Disconnect* with pointer reset (#626)
  • Install spawn_model using catkin_install_python (#624)
  • Quote arguments to echo in libcommon.sh (#591)
  • Contributors: Jose Luis Rivero

2.7.2 (2017-05-21)

  • Revert gazebo8 changes in Lunar and back to use gazebo7 (#583)
  • Contributors: Jose Luis Rivero

2.7.1 (2017-04-28)

  • Fixes for compilation and warnings in Lunar-devel (#573) Multiple fixes for compilation and warnings coming from Gazebo8 and ignition-math3
  • Add catkin package(s) to provide the default version of Gazebo - take II (kinetic-devel) (#571)
  • Contributors: Jose Luis Rivero

2.5.12 (2017-04-25)

2.5.11 (2017-04-18)

  • Changed the spawn model methods to spawn also lights. (#511)
  • Change build system to set DEPEND on Gazebo/SDFormat (fix catkin warning) Added missing DEPEND clauses to catkin_package to fix gazebo catkin warning. Note that after the change problems could appear related to -lpthreads errors. This is an known issue related to catkin: https://github.com/ros/catkin/issues/856.
  • Use correct logerr method (#557)
  • Contributors: Alessandro Ambrosano, Dave Coleman, Gary Servin

2.5.10 (2017-03-03)

  • Revert catkin warnings to fix regressions (problems with catkin -lpthreads errors) For reference and reasons, please check: https://discourse.ros.org/t/need-to-sync-new-release-of-rqt-topic-indigo-jade-kinetic/1410/4 * Revert \"Fix gazebo catkin warning, cleanup CMakeLists (#537)\" This reverts commit 5a0305fcb97864b66bc2e587fc0564435b4f2034. * Revert \"Fix gazebo and sdformat catkin warnings\" This reverts commit 11f95d25dcd32faccd2401d45c722f7794c7542c.

  • Contributors: Jose Luis Rivero

2.5.9 (2017-02-20)

  • Fix gazebo catkin warning, cleanup CMakeLists (#537)
  • Namespace console output (#543)
  • Removed all trailing whitespace
  • Contributors: Dave Coleman

2.5.8 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remapping by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Fixed getlinkstate service\'s angular velocity return
  • Honor GAZEBO_MASTER_URI in gzserver and gzclient
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, Martin Pecka

2.5.7 (2016-06-10)

2.5.6 (2016-04-28)

  • Remove deprecated spawn_gazebo_model service
  • Contributors: Steven Peters

2.5.5 (2016-04-27)

  • merge indigo, jade to kinetic-devel
  • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • disable gazebo_ros_control until dependencies are met
    • Remove stray backslash
  • spawn_model: adding -b option to bond to the model and delete it on sigint
  • Update maintainer for Kinetic release
  • Allow respawning gazebo node.
  • Contributors: Hugo Boyer, Isaac IY Saito, Jackie Kay, Jonathan Bohren, Jose Luis Rivero, Steven Peters

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Aguero, John Hsu, Jose Luis Rivero, Nate Koenig, Steven Peters, hsu, osrf

2.4.5 (2014-08-18)

  • Port fix_build branch for indigo-devel See pull request #221
  • Contributors: Jose Luis Rivero

2.4.4 (2014-07-18)

  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Vincenzo Comito

2.4.3 (2014-05-12)

  • added osx support for gazebo start scripts
  • Remove gazebo_ros dependency on gazebo_plugins
  • Contributors: Markus Achtelik, Steven Peters

2.4.2 (2014-03-27)

  • merging from hydro-devel
  • bump patch version for indigo-devel to 2.4.1
  • merging from indigo-devel after 2.3.4 release
  • \"2.4.0\"
  • catkin_generate_changelog
  • Contributors: John Hsu

2.4.1 (2013-11-13)

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • rerelease because sdformat became libsdformat, but we also based change on 2.3.4 in hydro-devel.
  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.4.0 (2013-10-14)

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.5.2
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version galactic
Last Updated 2022-11-21
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Alejandro Hernández Cordero
  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.5.2 (2021-03-15)

  • Remove slash from gazebo_ros scripts Python package name (#1251)
  • Fix line length in gazebo_ros/test/CMakeLists.txt (#1249)
  • gazebo_ros: use lxml in spawn_entity.py (#1221) The python xml.etree.ElementTree library does not handle xml namespaces well, replacing namespaces of prefixed elements with ns0, ns1, etc. This switches to using lxml instead, which has the same syntax and is already used by other ros2 packages. * Add a test
  • Fix tests for cyclonedds (#1228) The default RMW implementation changed recently and some tests are now failing. This fixes the tests. * Use KeepLast(1) with transient_local in tests There are some QoS incompatibilities in some tests that use SystemDefaultsQoS, so this changes them to use KeepLast(1) with transient_local instead. This fixes some of the test failures but not all.
    • test_sim_time: allow more startup messages
    • Fix QoS and initialization of joint state pub test
  • Fix executor to avoid random exceptions when shutting down (#1212)
    • Fix executor to avoid random exceptions when shutting down
    • Add link to related issue in rclcpp
  • ros2: Only subscribe to /gazebo/performance_metrics when necessary (#1205) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. This changes gazebo_ros_init to only subscribe to the gazebo topic if there are any subscribers to the corresponding ROS topic. While advertiser callbacks are used in ROS 1 but are not yet in ROS2, here we use polling in the GazeboRosInitPrivate::PublishSimTime callback to check for subscribers since it is called for each Gazebo time step. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a macro to reduce duplication of the version checking logic.
  • Contributors: Ivan Santiago Paunovic, Michel Hidalgo, Steve Peters

3.5.1 (2020-11-25)

  • colcon.pkg: build gazebo first in colcon workspace (#1192) Add a colcon.pkg file to gazebo_dev with gazebo\'s cmake project name \"Gazebo\" listed as a dependency to support building gazebo from source in a colcon workspace. * Add colcon.pkg files for other packages Copy colcon.pkg to gazebo_ros, gazebo_plugins, and gazebo_ros_control so that --merge-install won\'t be required. Signed-off-by: Steve Peters <scpeters@openrobotics.org>

  • Fixed Parameterized testing on Rolling (#1184) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [ROS 2] Bridge to republish PerformanceMetrics in ROS 2 (#1147) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • [Windows] Add missing visibility control. (#1150)

  • [ros2] Enable the force system on launch files (#1035) Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • make compile wo/ warnings on osx (#1149) Signed-off-by: Karsten Knese <Karsten1987@users.noreply.github.com>

  • Added lockstep argument to gzserver (#1146) Signed-off-by: ahcorde <ahcorde@gmail.com>

  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 3.5.3
License Apache 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version foxy
Last Updated 2022-11-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Utilities to interface with

Additional Links

Maintainers

  • Jose Luis Rivero
  • Louise Poubel

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

3.5.3 (2021-04-15)

  • Update default spawn_service_timeout to be consistent with other ROS2 distros (#1264)
    • update default timeout value to be consistent with other ROS2 distros
    • define timeout as a constant
  • Fix executor to avoid random exceptions when shutting down (#1212)
    • Fix executor to avoid random exceptions when shutting down
    • Add link to related issue in rclcpp
  • ros2: Only subscribe to /gazebo/performance_metrics when necessary (#1205) We are currently subscribing to the /gazebo/performance_metrics topic even if there are no subscribers to the ROS topic forwarding this data. This changes gazebo_ros_init to only subscribe to the gazebo topic if there are any subscribers to the corresponding ROS topic. While advertiser callbacks are used in ROS 1 but are not yet in ROS2, here we use polling in the GazeboRosInitPrivate::PublishSimTime callback to check for subscribers since it is called for each Gazebo time step. This also helps workaround the deadlock documented in #1175 and osrf/gazebo#2902. This also adds a macro to reduce duplication of the version checking logic.
  • colcon.pkg: build gazebo first in colcon workspace (#1192) Add a colcon.pkg file to gazebo_dev with gazebo\'s cmake project name \"Gazebo\" listed as a dependency to support building gazebo from source in a colcon workspace. * Add colcon.pkg files for other packages Copy colcon.pkg to gazebo_ros, gazebo_plugins, and gazebo_ros_control so that --merge-install won\'t be required.

  • [ROS 2] Bridge to republish PerformanceMetrics in ROS 2 (#1147)

  • [Windows] Add missing visibility control. (#1150)

  • [ros2] Enable the force system on launch files (#1035)

  • make compile wo/ warnings on osx (#1149)

  • Added lockstep argument to gzserver (#1146)

  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.7.6
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version lunar-devel
Last Updated 2019-03-23
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.7.6 (2018-06-07)

2.7.5 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (#711)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • Parameter to disable ROS network interaction from/to Gazebo (lunar-devel) (#704)
    • Merge initial part of 585 PR
    • Missing parts from the port to lunar
    • Fix last remaining code from merge
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS. (#676)
  • Pass verbose argument to gzclient (#677)
  • strip comments from parsed urdf (#698) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Contributors: Jose Luis Rivero

2.7.4 (2018-02-12)

  • Fix last gazebo8 warnings! (lunar-devel) (#664)
  • Fix for relative frame errors (lunar-devel) (#663)
  • Fix gazebo8 warnings part 7: retry #642 on lunar (#660)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (lunar-devel) (#657)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#655)
  • [gazebo_ros] don\'t overwrite parameter \"use_sim_time\" (lunar-devel) (#607)
  • Fix gazebo8 warnings part 8: ifdef\'s for GetWorldPose (lunar-devel) (#652)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#649)
  • for gazebo8+, call functions without Get (#640)
  • Contributors: Jose Luis Rivero, Steven Peters

2.7.3 (2017-12-11)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#627)
  • Fix gazebo8 warnings part 5: ignition math in gazebo_ros (lunar-devel) (#636)
  • Fix gazebo8 warnings part 4: convert remaining local variables in plugins to ign-math (lunar-devel) (#634)
  • gazebo_ros: fix support for python3 (#629)
  • Replace Events::Disconnect* with pointer reset (#626)
  • Install spawn_model using catkin_install_python (#624)
  • Quote arguments to echo in libcommon.sh (#591)
  • Contributors: Jose Luis Rivero

2.7.2 (2017-05-21)

  • Revert gazebo8 changes in Lunar and back to use gazebo7 (#583)
  • Contributors: Jose Luis Rivero

2.7.1 (2017-04-28)

  • Fixes for compilation and warnings in Lunar-devel (#573) Multiple fixes for compilation and warnings coming from Gazebo8 and ignition-math3
  • Add catkin package(s) to provide the default version of Gazebo - take II (kinetic-devel) (#571)
  • Contributors: Jose Luis Rivero

2.5.12 (2017-04-25)

2.5.11 (2017-04-18)

  • Changed the spawn model methods to spawn also lights. (#511)
  • Change build system to set DEPEND on Gazebo/SDFormat (fix catkin warning) Added missing DEPEND clauses to catkin_package to fix gazebo catkin warning. Note that after the change problems could appear related to -lpthreads errors. This is an known issue related to catkin: https://github.com/ros/catkin/issues/856.
  • Use correct logerr method (#557)
  • Contributors: Alessandro Ambrosano, Dave Coleman, Gary Servin

2.5.10 (2017-03-03)

  • Revert catkin warnings to fix regressions (problems with catkin -lpthreads errors) For reference and reasons, please check: https://discourse.ros.org/t/need-to-sync-new-release-of-rqt-topic-indigo-jade-kinetic/1410/4 * Revert \"Fix gazebo catkin warning, cleanup CMakeLists (#537)\" This reverts commit 5a0305fcb97864b66bc2e587fc0564435b4f2034. * Revert \"Fix gazebo and sdformat catkin warnings\" This reverts commit 11f95d25dcd32faccd2401d45c722f7794c7542c.

  • Contributors: Jose Luis Rivero

2.5.9 (2017-02-20)

  • Fix gazebo catkin warning, cleanup CMakeLists (#537)
  • Namespace console output (#543)
  • Removed all trailing whitespace
  • Contributors: Dave Coleman

2.5.8 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remapping by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Fixed getlinkstate service\'s angular velocity return
  • Honor GAZEBO_MASTER_URI in gzserver and gzclient
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, Martin Pecka

2.5.7 (2016-06-10)

2.5.6 (2016-04-28)

  • Remove deprecated spawn_gazebo_model service
  • Contributors: Steven Peters

2.5.5 (2016-04-27)

  • merge indigo, jade to kinetic-devel
  • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • disable gazebo_ros_control until dependencies are met
    • Remove stray backslash
  • spawn_model: adding -b option to bond to the model and delete it on sigint
  • Update maintainer for Kinetic release
  • Allow respawning gazebo node.
  • Contributors: Hugo Boyer, Isaac IY Saito, Jackie Kay, Jonathan Bohren, Jose Luis Rivero, Steven Peters

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Aguero, John Hsu, Jose Luis Rivero, Nate Koenig, Steven Peters, hsu, osrf

2.4.5 (2014-08-18)

  • Port fix_build branch for indigo-devel See pull request #221
  • Contributors: Jose Luis Rivero

2.4.4 (2014-07-18)

  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Vincenzo Comito

2.4.3 (2014-05-12)

  • added osx support for gazebo start scripts
  • Remove gazebo_ros dependency on gazebo_plugins
  • Contributors: Markus Achtelik, Steven Peters

2.4.2 (2014-03-27)

  • merging from hydro-devel
  • bump patch version for indigo-devel to 2.4.1
  • merging from indigo-devel after 2.3.4 release
  • \"2.4.0\"
  • catkin_generate_changelog
  • Contributors: John Hsu

2.4.1 (2013-11-13)

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • rerelease because sdformat became libsdformat, but we also based change on 2.3.4 in hydro-devel.
  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.4.0 (2013-10-14)

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/willowgarage_world.launch
  • launch/empty_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: false]
      • output [default: screen]
      • world_name [default: worlds/empty.world]
      • respawn_gazebo [default: false]
      • use_clock_frequency [default: false]
      • pub_clock_frequency [default: 100]
      • enable_ros_network [default: true]
  • launch/range_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world [default: gazebo_ros_range]
  • launch/elevator_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world_name [default: worlds/elevator_ros.world]
  • launch/mud_world.launch
  • launch/rubble_world.launch
  • launch/shapes_world.launch

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.6.2
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2017-02-20
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.6.2 (2017-02-20)

2.6.1 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remappings by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts\"
  • Added comments regarding \'headless\' arg. Added \'recording\' arg as switch for -r
  • Fixed getlinkstate service\'s angular velocity return
  • Add a roslaunch \'required\' argument: enables the \'required\' flag on gazebo_gui node
  • Add an argument to enable required flag on gazebo gui, same tag name \"required\" as in ROS
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, vincentrou

2.6.0 (2016-08-04)

  • Honor GAZEBO_MASTER_URI for gzserver and gzclient.
  • Contributors: Martin Pecka

2.5.4 (2016-04-27)

  • Update maintainer for Kinetic release
  • support to change clock frequncy from ros param
  • Allow respawning gazebo node.
  • Add option to change package:// to model:// when loading urdf file
  • Fix string replacement to look for mesh filename surrounded by single or double quotes.
  • Contributors: Isaac IY Saito, John Hsu, Jose Luis Rivero, Kei Okada, Steven Peters, Yuki Furuta

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Ag

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/willowgarage_world.launch
  • launch/empty_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: false]
      • world_name [default: worlds/empty.world]
      • respawn_gazebo [default: false]
      • use_clock_frequency [default: false]
      • pub_clock_frequency [default: 100]
      • required [default: false]
  • launch/range_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • world [default: gazebo_ros_range]
  • launch/elevator_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • world_name [default: worlds/elevator_ros.world]
  • launch/mud_world.launch
  • launch/rubble_world.launch
  • launch/shapes_world.launch

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.4.16
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-10-03
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • John Hsu
  • Dave Coleman

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.4.16 (2018-06-04)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#731) An xml comment that start with plugin causes a seg-fault: <!--plugin--> or <!--plugin filename=\"lib.so\"/--> This fixes the xml parsing to not try to add child elements to xml comments.
  • Contributors: Jose Luis Rivero

2.4.15 (2017-08-09)

  • Fix build (#600) This reverts commit 3f12a2ec3c4e0d91541bd533a0d6290d9d4d0558.
  • Contributors: Jose Luis Rivero

2.4.14 (2017-06-24)

  • fixed conflicts
  • Contributors: Jose Luis Rivero

2.4.13 (2017-02-28)

2.4.12 (2016-11-27)

  • Fixed getLinkState service\'s angular velocity return
  • Contributors: Jared

2.4.11 (2016-07-14)

  • GAZEBO_MASTER_URI is loaded from setup.sh if empty in environment.
  • Honor GAZEBO_MASTER_URI for gzserver.
  • Honor GAZEBO_MASTER_URI for gzclient.
  • Fix string replacement to look for mesh filename surrounded by single or double quotes. Also do not replace unless there are two slashes after package
  • Merge pull request #423 from furushchev/fix-include [gazebo_ros] fix include path
  • Include {PROJECT_NAME}_EXPORTED_TARGETS into dependencies for dynamic reconfiguration
  • [gazebo_ros] put header file to standard catkin include path
  • Add rostest to accompany range plugin world
  • Follow ROS documentation and depend on catkin_EXPORTED_TARGETS
  • Remove all references to gazebo_msgs_gencpp (ghost)
  • missing link_directories()
  • add option to change package:// to model:// when loading urdf file
  • Contributors: Bence Magyar, John Hsu, Jose Luis Rivero, Kei Okada, Martin Pecka, Steven Peters, Yuki Furuta

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Ag

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ati_force_torque github-iirob-ati_force_torque
cob_description github-ipa320-cob_common
raw_description github-ipa320-cob_common
cob_gazebo_ros_control github-ipa320-cob_gazebo_plugins
cob_bringup_sim github-ipa320-cob_simulation
cob_gazebo github-ipa320-cob_simulation
cob_gazebo_objects github-ipa320-cob_simulation
cob_gazebo_worlds github-ipa320-cob_simulation
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetchit_challenge github-fetchrobotics-fetch_gazebo
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_control github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_thermal_camera github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_worlds github-tu-darmstadt-ros-pkg-hector_gazebo
jackal_gazebo github-jackal-jackal_simulator
eusurdf github-jsk-ros-pkg-jsk_model_tools
kobuki_gazebo github-yujinrobot-kobuki_desktop
kobuki_gazebo_plugins github-yujinrobot-kobuki_desktop
mir_gazebo github-dfki-ric-mir_robot
mrp2_gazebo github-milvusrobotics-mrp2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
raspimouse_gazebo github-rt-net-raspimouse_sim
ridgeback_gazebo github-ridgeback-ridgeback_simulator
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
nextage_calibration github-tork-a-rtmros_nextage
nextage_gazebo github-tork-a-rtmros_nextage
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
tork_moveit_tutorial github-tork-a-tork_moveit_tutorial
ur_gazebo github-ros-industrial-universal_robot
uos_gazebo_worlds github-uos-uos_tools
velodyne_gazebo_plugins bitbucket-DataspeedInc-velodyne_simulator
warthog_gazebo github-warthog-cpr-warthog_simulator
abb_irb120_gazebo github-ros-industrial-abb_experimental
agvs_gazebo github-RobotnikAutomation-agvs_sim
barrett_hand_gazebo github-RobotnikAutomation-barrett_hand_sim
vs060_gazebo github-start-jsk-denso
diffdrive_gazebo_plugin github-uos-diffdrive_gazebo_plugin
grizzly_gazebo github-g-grizzly_simulator
grizzly_gazebo_plugins github-g-grizzly_simulator
hector_nist_arena_elements github-tu-darmstadt-ros-pkg-hector_nist_arenas_gazebo
hector_quadrotor_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_quadrotor
katana_arm_gazebo github-uos-katana_driver
katana_gazebo_plugins github-uos-katana_driver
nao_gazebo_plugin github-ros-naoqi-nao_virtual
pepper_gazebo_plugin github-ros-naoqi-pepper_virtual
pheeno_ros_sim github-ACSLaboratory-pheeno_ros_sim
rb1_base_gazebo github-RobotnikAutomation-rb1_base_sim
rb1_base_sim_bringup github-RobotnikAutomation-rb1_base_sim
rbcar_gazebo github-RobotnikAutomation-rbcar_sim
robotiq_s_model_articulated_gazebo github-ros-industrial-robotiq
robotiq_s_model_articulated_gazebo_plugins github-ros-industrial-robotiq
roch_gazebo github-SawYer-Robotics-roch_simulator
romeo_gazebo_plugin github-ros-aldebaran-romeo_virtual
summit_x_gazebo github-RobotnikAutomation-summit_x_sim
summit_x_sim_bringup github-RobotnikAutomation-summit_x_sim
summit_xl_gazebo github-RobotnikAutomation-summit_xl_sim
summit_xl_sim_bringup github-RobotnikAutomation-summit_xl_sim
create_gazebo_plugins github-turtlebot-turtlebot_create_desktop
turtlebot_gazebo github-turtlebot-turtlebot_simulator
bwi_gazebo_entities github-utexas-bwi-bwi_common
utexas_gdc github-utexas-bwi-bwi_common
calvin_gazebo github-uos-calvin_robot
darwin_gazebo github-HumaRobotics-darwin_gazebo
husky_gazebo github-husky-husky_simulator
phantomx_control github-HumaRobotics-phantomx_control
phantomx_gazebo github-HumaRobotics-phantomx_gazebo
eusgazebo github-start-jsk-rtmros_gazebo
hrpsys_gazebo_general github-start-jsk-rtmros_gazebo
segbot_gazebo github-utexas-bwi-segbot
youbot_gazebo_robot github-youbot-youbot_simulation
youbot_gazebo_worlds github-youbot-youbot_simulation
aubo_gazebo github-auboliuxin-aubo_robot
baxter_gazebo github-RethinkRobotics-baxter_simulator
baxter_sim_examples github-RethinkRobotics-baxter_simulator
cirkit_unit03_gazebo github-CIR-KIT-Unit03-cirkit_unit03_simulator
evarobot_gazebo github-inomuh-evarobot_simulator
freefloating_gazebo github-freefloating-gazebo-freefloating_gazebo
gazebo_grasp_plugin github-JenniferBuehler-gazebo-pkgs
gazebo_state_plugins github-JenniferBuehler-gazebo-pkgs
gazebo_test_tools github-JenniferBuehler-gazebo-pkgs
gazebo_version_helpers github-JenniferBuehler-gazebo-pkgs
gazebo_world_plugin_loader github-JenniferBuehler-gazebo-pkgs
tetris_gazebo github-tork-a-hakuto
human_model_gazebo github-CIR-KIT-human_detector
icart_mini_gazebo github-open-rdc-icart_mini
jaco_gazebo github-GT-RAIL-jaco_gazebo
jsk_2016_01_baxter_apc github-start-jsk-jsk_apc
jsk_apc2015_common github-start-jsk-jsk_apc
schunk_lwa4d github-ipa320-schunk_robots
schunk_lwa4p github-ipa320-schunk_robots
schunk_lwa4p_extended github-ipa320-schunk_robots
schunk_pg70 github-ipa320-schunk_robots
spur_gazebo github-tork-a-spur
robotino_description github-squirrel-project-squirrel_common
softhand_description github-squirrel-project-squirrel_common
talos_description github-openrobotics-talos_description
usv_gazebo_plugins github-bsb808-usv_gazebo_plugins
gazebo_mimic github-OrebroUniversity-yumi
yumi_control github-OrebroUniversity-yumi

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.3.8
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-03-17
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • John Hsu
  • Dave Coleman

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.3.8 (2015-03-17)

  • Merge pull request #235 from ros-simulation/issue_93_set_joint_position_hydro add test for issue #93, set joint position on spawn_model
  • spawn_model: adding joint rosparam
  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Specify physics engine in args to empty_world.launch
  • Fixing handling of non-world frame velocities in setModelState.
  • add test for issue #93, set joint position on spawn_model
  • update license to Apache 2.0 for hydro
  • Contributors: John Hsu, Jonathan Bohren, Steven Peters, Tom Moore, ayrton04, hsu

2.3.7 (2014-09-01)

  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Contributors: John Hsu

2.3.6 (2014-08-18)

  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • fix issue #198 Operator == is not recognized by sh scripts.
  • fix issue #198 Operator == is not recognized by sh scripts.
  • fix issue #198 Operator == is not recognized by sh scripts.
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Nate Koenig, Vincenzo Comito

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_bringup_sim github-ipa320-cob_simulation
cob_gazebo github-ipa320-cob_simulation
cob_gazebo_objects github-ipa320-cob_simulation
cob_gazebo_worlds github-ipa320-cob_simulation
gazebo_ros_control github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_thermal_camera github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_worlds github-tu-darmstadt-ros-pkg-hector_gazebo
kobuki_gazebo github-yujinrobot-kobuki_desktop
kobuki_gazebo_plugins github-yujinrobot-kobuki_desktop
pr2_gazebo_plugins github-PR2-pr2_simulator
schunk_description github-ipa320-schunk_modular_robotics
ur_gazebo github-ros-industrial-universal_robot
uos_gazebo_worlds github-uos-uos_tools
diffdrive_gazebo_plugin github-uos-diffdrive_gazebo_plugin
grizzly_gazebo github-g-grizzly_simulator
grizzly_gazebo_plugins github-g-grizzly_simulator
hector_nist_arena_elements github-tu-darmstadt-ros-pkg-hector_nist_arenas_gazebo
hector_quadrotor_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_quadrotor
katana_arm_gazebo github-uos-katana_driver
katana_gazebo_plugins github-uos-katana_driver
nao_gazebo_plugin github-ros-naoqi-nao_virtual
rosjava_messages github-rosjava-rosjava_messages
create_gazebo_plugins github-turtlebot-turtlebot_create_desktop
turtlebot_gazebo github-turtlebot-turtlebot_simulator
agvs_gazebo github-RobotnikAutomation-agvs
calvin_gazebo github-uos-calvin_robot
darwin_gazebo github-HumaRobotics-darwin_gazebo
guardian_gazebo github-RobotnikAutomation-guardian_sim
husky_gazebo github-husky-husky_simulator
husky_gazebo_plugins github-husky-husky_simulator
gazebo_interface github-DLu-nasa_r2_simulator
r2_gazebo github-DLu-nasa_r2_simulator
phantomx_control github-HumaRobotics-phantomx_control
phantomx_gazebo github-HumaRobotics-phantomx_gazebo
pmb2_gazebo github-pal-robotics-pmb2_simulation
roomba_robin_gazebo github-robinJKU-roomba_robin_simulator
eusgazebo github-start-jsk-rtmros_gazebo
hrpsys_gazebo_general github-start-jsk-rtmros_gazebo
segbot_gazebo github-utexas-bwi-segbot_simulator
sr_hand github-shadow-robot-sr-ros-interface
sr_tactile_sensors github-shadow-robot-sr-ros-interface
youbot_gazebo_robot github-youbot-youbot_simulation
youbot_gazebo_worlds github-youbot-youbot_simulation

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.5.21
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2021-04-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.5.20 (2020-05-08)

2.5.19 (2019-06-04)

  • Add output arg to launch files, plus some small fixes (#905)

    • Add output arg to empty_world
    • add output arg to elevator_world
    • add output arg to range_world

    * don\'t set use_sim_time in range_world Instead parse it to empty world, where it will be set. - add xml prolog to all launch files - Remove unnecessary arg in range_world.launch

  • Contributors: Matthijs van der Burgh

2.5.18 (2019-01-23)

  • Fix typo exist -> exists (#833)
  • Fix issue #198 (#823)
  • Contributors: Daniel Ingram, Jack Liu, Steven Peters

2.5.17 (2018-06-07)

2.5.16 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (kinetic-devel) (#723)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • strip comments from parsed urdf (#695) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Merge pull request #672 from ros-simulation/gzclient_verbose Pass verbose argument to gzclient
  • Merge pull request #670 from ros-simulation/add_ros_api_plugin_to_gzclient Load the libgazebo_ros_api_plugin when starting gzclient
  • Pass verbose argument to gzclient
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS.
  • Contributors: Brian Gerkey, Jose Luis Rivero, Steven Peters, azhural, chapulina

2.5.15 (2018-02-12)

  • Fix last gazebo8 warnings! (#658)
  • Fix for relative frame errors (#605)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (#656)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#653)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#644)
  • Fix gazebo8 warnings part 7: ifdef\'s for Joint::GetAngle and some cleanup (#642)
  • Contributors: Hamza Merzi

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_gazebo_plugins github-AinsteinAI-ainstein_radar
ati_force_torque github-KITrobotics-ati_force_torque
audibot_gazebo github-robustify-audibot
blender_gazebo github-david0429-blender_gazebo
cob_description github-ipa320-cob_common
raw_description github-ipa320-cob_common
cob_gazebo_plugins github-ipa320-cob_gazebo_plugins
cob_gazebo_ros_control github-ipa320-cob_gazebo_plugins
cob_bringup_sim github-ipa320-cob_simulation
cob_gazebo github-ipa320-cob_simulation
cob_gazebo_objects github-ipa320-cob_simulation
cob_gazebo_worlds github-ipa320-cob_simulation
desistek_saga_description github-uuvsimulator-desistek_saga
eca_a9_description github-uuvsimulator-eca_a9
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetchit_challenge github-fetchrobotics-fetch_gazebo
franka_gazebo github-frankaemika-franka_ros
gazebo_ros_control github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
gundam_rx78_gazebo github-gundam-global-challenge-gundam_robot
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_worlds github-tu-darmstadt-ros-pkg-hector_gazebo
heron_gazebo github-heron-heron_simulator
husky_gazebo github-husky-husky
igvc_self_drive_gazebo github-robustify-igvc_self_drive_sim
igvc_self_drive_gazebo_plugins github-robustify-igvc_self_drive_sim
jackal_gazebo github-jackal-jackal_simulator
eusurdf github-jsk-ros-pkg-jsk_model_tools
khi_rs_gazebo github-Kawasaki-Robotics-khi_robot
kobuki_gazebo github-yujinrobot-kobuki_desktop
kobuki_gazebo_plugins github-yujinrobot-kobuki_desktop
lauv_description github-uuvsimulator-lauv_gazebo
mir_gazebo github-dfki-ric-mir_robot
moose_gazebo github-moose-cpr-moose_simulator
nmea_gps_plugin github-OUXT-Polaris-nmea_gps_plugin
open_manipulator_p_gazebo github-ROBOTIS-GIT-open_manipulator_p_simulations
open_manipulator_gazebo github-ROBOTIS-GIT-open_manipulator_simulations
open_manipulator_with_tb3_gazebo github-ROBOTIS-GIT-open_manipulator_with_tb3_simulations
prbt_gazebo github-PilzDE-pilz_robots
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
raspimouse_gazebo github-rt-net-raspimouse_sim
rexrov2_control github-uuvsimulator-rexrov2
rexrov2_description github-uuvsimulator-rexrov2
ridgeback_gazebo github-ridgeback-ridgeback_simulator
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
roboticsgroup_upatras_gazebo_plugins github-roboticsgroup-roboticsgroup_upatras_gazebo_plugins
ackermann_steering_controller github-ros-controls-ros_controllers
rr_openrover_description github-RoverRobotics-rr_openrover_stack
rr_openrover_simulation github-RoverRobotics-rr_openrover_stack
nextage_calibration github-tork-a-rtmros_nextage
nextage_gazebo github-tork-a-rtmros_nextage
seed_r7_gazebo github-seed-solutions-seed_r7_ros_pkg
sr_hand github-shadow-robot-sr_core
sr_tactile_sensors github-shadow-robot-sr_core
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
turtlebot3_gazebo github-ROBOTIS-GIT-turtlebot3_simulations
baylands github-osrf-uav_testing
ksql_airport github-osrf-uav_testing
mcmillan_airfield github-osrf-uav_testing
sand_island github-osrf-uav_testing
yosemite_valley github-osrf-uav_testing
ur_e_gazebo github-ros-industrial-universal_robot
ur_gazebo github-ros-industrial-universal_robot
uos_gazebo_worlds github-uos-uos_tools
uuv_descriptions github-uuvsimulator-uuv_simulator
uuv_gazebo_worlds github-uuvsimulator-uuv_simulator
uuv_tutorial_seabed_world github-uuvsimulator-uuv_simulator
velodyne_gazebo_plugin github-beltransen-velo2cam_gazebo
velodyne_gazebo_plugins bitbucket-DataspeedInc-velodyne_simulator
volta_simulation github-botsync-volta_simulation
warthog_gazebo github-warthog-cpr-warthog_simulator
abb_irb1200_gazebo github-ros-industrial-abb_experimental
abb_irb120_gazebo github-ros-industrial-abb_experimental
agvs_gazebo github-RobotnikAutomation-agvs_sim
barrett_hand_gazebo github-RobotnikAutomation-barrett_hand_sim
vs060_gazebo github-start-jsk-denso
diffdrive_gazebo_plugin github-uos-diffdrive_gazebo_plugin
common github-doosan-robotics-doosan-robot
dsr_gazebo github-doosan-robotics-doosan-robot
dsr_launcher github-doosan-robotics-doosan-robot
grizzly_gazebo github-g-grizzly_simulator
hebiros_gazebo_plugin github-HebiRobotics-HEBI-ROS
hector_nist_arena_elements github-tu-darmstadt-ros-pkg-hector_nist_arenas_gazebo
iiwa_gazebo github-ipa-rwu-iiwa_stack
katana_arm_gazebo github-uos-katana_driver
katana_gazebo_plugins github-uos-katana_driver
magni_gazebo github-UbiquityRobotics-magni_robot
manipulator_h_gazebo github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
mobility_base_gazebo bitbucket-dataspeedinc-mobility_base_simulator
mobility_base_gazebo_plugins bitbucket-dataspeedinc-mobility_base_simulator
multi_jackal_base github-NicksSimulationsROS-multi_jackal
multi_jackal_description github-NicksSimulationsROS-multi_jackal
multi_jackal_tutorials github-NicksSimulationsROS-multi_jackal
nao_gazebo_plugin github-ros-naoqi-nao_virtual
pepper_gazebo_plugin github-ros-naoqi-pepper_virtual
pheeno_ros_sim github-ACSLaboratory-pheeno_ros_sim
pioneer_mrs github-hanzheteng-pioneer_mrs
rb1_base_gazebo github-RobotnikAutomation-rb1_base_sim
rb1_base_sim_bringup github-RobotnikAutomation-rb1_base_sim
rbcar_gazebo github-RobotnikAutomation-rbcar_sim
rh_p12_rn_gazebo github-ROBOTIS-GIT-RH-P12-RN
robotiq_3f_gripper_articulated_gazebo github-ros-industrial-robotiq
robotiq_3f_gripper_articulated_gazebo_plugins github-ros-industrial-robotiq
op3_gazebo github-ROBOTIS-GIT-ROBOTIS-OP3-Common
roch_gazebo github-SawYer-Robotics-roch_simulator
romeo_gazebo_plugin github-ros-aldebaran-romeo_virtual
rsv_balance_gazebo github-robosavvy-rsv_balance_simulator
summit_x_gazebo github-RobotnikAutomation-summit_x_sim
summit_x_sim_bringup github-RobotnikAutomation-summit_x_sim
summit_xl_gazebo github-RobotnikAutomation-summit_xl_sim
summit_xl_sim_bringup github-RobotnikAutomation-summit_xl_sim
svenzva_description github-SvenzvaRobotics-svenzva_ros
thormang3_gazebo github-ROBOTIS-GIT-ROBOTIS-THORMANG-Common
create_gazebo_plugins github-turtlebot-turtlebot_create_desktop
turtlebot_gazebo github-turtlebot-turtlebot_simulator
xbot_description github-DroidAITech-xbot

Launch files

  • launch/willowgarage_world.launch
  • launch/empty_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: false]
      • output [default: screen]
      • world_name [default: worlds/empty.world]
      • respawn_gazebo [default: false]
      • use_clock_frequency [default: false]
      • pub_clock_frequency [default: 100]
      • server_required [default: false]
      • gui_required [default: false]
  • launch/range_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world [default: gazebo_ros_range]
  • launch/elevator_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world_name [default: worlds/elevator_ros.world]
  • launch/mud_world.launch
  • launch/rubble_world.launch
  • launch/shapes_world.launch

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.8.7
License Apache 2.0
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-simulation/gazebo_ros_pkgs.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-08-23
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Provides ROS plugins that offer message and service publishers for interfacing with

Additional Links

Maintainers

  • Jose Luis Rivero

Authors

  • John Hsu
  • Nate Koenig
  • Dave Coleman
README
No README found. See repository README.
CHANGELOG

Changelog for package gazebo_ros

2.8.7 (2020-05-01)

2.8.6 (2019-12-26)

  • ROS API: remove unhelpful error in GetWorldProperties call (#747)
  • Create reconfigure thread only if network enabled (#919) This thread was blocked in client.waitForExistance because the services it depends on are only created if [enable_ros_network]{.title-ref} is true. This in turn blocked gazebo from being shut down. Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>
  • spawn_model: Fix urlparse imports for Python 3
  • spawn_model: Ensure that \"model_xml\" is a string, required for Python 3
  • catkin_find gazebo plugin from bin folder. (#993)
  • [Windows][melodic-devel] more Windows build break fix (#975)
    • Fix CMake install error for Windows build.
    • conditionally include <sys/time.h>
  • provide Windows implemenation for setenv. (#879)
  • implement basic gazebo scripts to support launch file on Windows build. (#880)
  • Contributors: Kartik Mohta, Kevin Allen, Sean Yen, Shane Loretz

2.8.5 (2019-06-04)

  • Add output arg to launch files, plus some small fixes (melodic) (#907)

    • Add output arg to empty_world
    • add output arg to elevator_world
    • add output arg to range_world

    * don\'t set use_sim_time in range_world Instead parse it to empty world, where it will be set. - add xml prolog to all launch files - Remove unnecessary arg in range_world.launch

  • use C++11 std sleep instead of usleep. (#877)

  • fix issue #198 (#825)

  • Lower minimum cmake version (#817)

  • Contributors: Matthijs van der Burgh, Paul Bovbel, Sean Yen [MSFT], Steven Peters

2.8.4 (2018-07-06)

  • Refactor spawn_model script
    • more robust -package_to_model implementation (issue #449)
    • add stdin as source option
    • parse arguments with argparse
    • remove deprecated/unused -gazebo and -trimesh options
  • Fix physics reconfigure within namespace (issue #507)
  • Contributors: Kevin Allen, Steven Peters

2.8.3 (2018-06-04)

  • Use generic SIGINT parameter in kill command for gazebo script (melodic-devel) (#724)
    • Use generic SIGINT parameter in kill command for gazebo script
    • redirect to kill command to std_err
  • Contributors: Jose Luis Rivero

2.8.2 (2018-05-09)

  • Fix the build on Ubuntu Artful. (#715) Artful has some bugs in its cmake files for Simbody that cause it to fail the build. If we are on artful, remove the problematic entries. Signed-off-by: Chris Lalancette <clalancette@openrobotics.org>
  • Contributors: Chris Lalancette

2.8.1 (2018-05-05)

  • Parameter to disable ROS network interaction from/to Gazebo (lunar-devel) (#704)
  • Load the libgazebo_ros_api_plugin when starting gzclient so that the ROS event loop will turn over, which is required when you have a client-side Gazebo plugin that uses ROS. (#676)
  • Pass verbose argument to gzclient (#677)
  • strip comments from parsed urdf (#698) Remove comments from urdf before trying to find packages. Otherwise non-existant packages will produce a fatal error, even though they are not used.
  • Contributors: Jose Luis Rivero

2.7.4 (2018-02-12)

  • Fix last gazebo8 warnings! (lunar-devel) (#664)
  • Fix for relative frame errors (lunar-devel) (#663)
  • Fix gazebo8 warnings part 7: retry #642 on lunar (#660)
  • Fix gazebo8 warnings part 10: ifdefs for GetModel, GetEntity, Light (lunar-devel) (#657)
  • gazebo8 warnings: ifdefs for Get.*Vel() (#655)
  • [gazebo_ros] don\'t overwrite parameter \"use_sim_time\" (lunar-devel) (#607)
  • Fix gazebo8 warnings part 8: ifdef\'s for GetWorldPose (lunar-devel) (#652)
  • Prevents GAZEBO_MODEL_DATABASE_URI from being overwritten (#649)
  • for gazebo8+, call functions without Get (#640)
  • Contributors: Jose Luis Rivero, Steven Peters

2.7.3 (2017-12-11)

  • gazebo_ros_api_plugin: improve plugin xml parsing (#627)
  • Fix gazebo8 warnings part 5: ignition math in gazebo_ros (lunar-devel) (#636)
  • Fix gazebo8 warnings part 4: convert remaining local variables in plugins to ign-math (lunar-devel) (#634)
  • gazebo_ros: fix support for python3 (#629)
  • Replace Events::Disconnect* with pointer reset (#626)
  • Install spawn_model using catkin_install_python (#624)
  • Quote arguments to echo in libcommon.sh (#591)
  • Contributors: Jose Luis Rivero

2.7.2 (2017-05-21)

  • Revert gazebo8 changes in Lunar and back to use gazebo7 (#583)
  • Contributors: Jose Luis Rivero

2.7.1 (2017-04-28)

  • Fixes for compilation and warnings in Lunar-devel (#573) Multiple fixes for compilation and warnings coming from Gazebo8 and ignition-math3
  • Add catkin package(s) to provide the default version of Gazebo - take II (kinetic-devel) (#571)
  • Contributors: Jose Luis Rivero

2.5.12 (2017-04-25)

2.5.11 (2017-04-18)

  • Changed the spawn model methods to spawn also lights. (#511)
  • Change build system to set DEPEND on Gazebo/SDFormat (fix catkin warning) Added missing DEPEND clauses to catkin_package to fix gazebo catkin warning. Note that after the change problems could appear related to -lpthreads errors. This is an known issue related to catkin: https://github.com/ros/catkin/issues/856.
  • Use correct logerr method (#557)
  • Contributors: Alessandro Ambrosano, Dave Coleman, Gary Servin

2.5.10 (2017-03-03)

  • Revert catkin warnings to fix regressions (problems with catkin -lpthreads errors) For reference and reasons, please check: https://discourse.ros.org/t/need-to-sync-new-release-of-rqt-topic-indigo-jade-kinetic/1410/4 * Revert \"Fix gazebo catkin warning, cleanup CMakeLists (#537)\" This reverts commit 5a0305fcb97864b66bc2e587fc0564435b4f2034. * Revert \"Fix gazebo and sdformat catkin warnings\" This reverts commit 11f95d25dcd32faccd2401d45c722f7794c7542c.

  • Contributors: Jose Luis Rivero

2.5.9 (2017-02-20)

  • Fix gazebo catkin warning, cleanup CMakeLists (#537)
  • Namespace console output (#543)
  • Removed all trailing whitespace
  • Contributors: Dave Coleman

2.5.8 (2016-12-06)

  • Workaround to support gazebo and ROS arguments in the command line
  • Fix ROS remapping by reverting \"Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Fixed getlinkstate service\'s angular velocity return
  • Honor GAZEBO_MASTER_URI in gzserver and gzclient
  • Contributors: Jared, Jon Binney, Jordan Liviero, Jose Luis Rivero, Martin Pecka

2.5.7 (2016-06-10)

2.5.6 (2016-04-28)

  • Remove deprecated spawn_gazebo_model service
  • Contributors: Steven Peters

2.5.5 (2016-04-27)

  • merge indigo, jade to kinetic-devel
  • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • Upgrade to gazebo 7 and remove deprecated driver_base dependency
    • disable gazebo_ros_control until dependencies are met
    • Remove stray backslash
  • spawn_model: adding -b option to bond to the model and delete it on sigint
  • Update maintainer for Kinetic release
  • Allow respawning gazebo node.
  • Contributors: Hugo Boyer, Isaac IY Saito, Jackie Kay, Jonathan Bohren, Jose Luis Rivero, Steven Peters

2.5.3 (2016-04-11)

  • Include binary in runtime
  • Remove ROS remapping arguments from gazebo_ros launch scripts.
  • Contributors: Jose Luis Rivero, Martin Pecka

2.5.2 (2016-02-25)

  • merging from indigo-devel
  • Merge pull request #302 from maxbader/jade-devel-GetModelState Header for GetModelState service request for jade-devel
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • 2.4.9
  • Generate changelog
  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • GetModelState modification for jade
  • Contributors: Bence Magyar, Boris Gromov, Guillaume Walck, Ian Chen, John Hsu, Jose Luis Rivero, Markus Bader, Steven Peters, hsu

2.5.1 (2015-08-16)

  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev (#323) Declare the dependency. It can be fixed later if we don\'t want it.
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters
  • Port of Pal Robotics range sensor plugin to Jade
  • Added a comment about the need of libgazebo5-dev in runtime
  • Added missing files
  • Added elevator plugin
  • Use c++11
  • run_depend on libgazebo5-dev
  • Contributors: Jose Luis Rivero, Nate Koenig, Steven Peters

2.5.0 (2015-04-30)

  • run_depend on libgazebo5-dev instead of gazebo5
  • Changed the rosdep key for gazebo to gazebo5, for Jade Gazebo5 will be used.
  • Contributors: Steven Peters, William Woodall

2.4.10 (2016-02-25)

  • Fix invalid signal name on OS X scripts/gazebo: line 30: kill: SIGINT: invalid signal specification
  • Restart package resolving from last position, do not start all over.
  • Contributors: Boris Gromov, Guillaume Walck

2.4.9 (2015-08-16)

  • Import changes from jade-branch
  • Add range world and launch file
  • fix crash
  • Set GAZEBO_CXX_FLAGS to fix c++11 compilation errors
  • Contributors: Bence Magyar, Ian Chen, Jose Luis Rivero, Steven Peters

2.4.8 (2015-03-17)

  • Specify physics engine in args to empty_world.launch
  • Contributors: Steven Peters

2.4.7 (2014-12-15)

  • temporary hack to fix the -J joint position option (issue #93), sleeping for 1 second to avoid race condition. this branch should only be used for debugging, merge only as a last resort.
  • Fixing set model state method and test
  • Extended the fix for #246 also to debug, gazebo, gzclient and perf scripts.
  • Update Gazebo/ROS tutorial URL
  • [gazebo_ros] Fix for #246 Fixing issue #246 in gzserver.
  • Fixing handling of non-world frame velocities in setModelState.
  • update headers to apache 2.0 license
  • update headers to apache 2.0 license
  • Contributors: John Hsu, Jose Luis Rivero, Martin Pecka, Tom Moore, ayrton04

2.4.6 (2014-09-01)

  • Merge pull request #232 from ros-simulation/fix_get_physics_properties_non_ode Fix get physics properties non ode
  • Merge pull request #183 from ros-simulation/issue_182 Fix STL iterator errors, misc. cppcheck (#182)
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • check physics engine type before calling set_physics_properties and get_physics_properteis
  • Fixes for calling GetParam() with different physic engines.
  • 2.3.6
  • Update changelogs for the upcoming release
  • Fixed boost any cast
  • Removed a few warnings
  • Update for hydro + gazebo 1.9
  • Fix build with gazebo4 and indigo
  • Fix STL iterator errors, misc. cppcheck (#182) There were some errors in STL iterators. Initialized values of member variables in constructor. Removed an unused variable (model_name).
  • Contributors: Carlos Aguero, John Hsu, Jose Luis Rivero, Nate Koenig, Steven Peters, hsu, osrf

2.4.5 (2014-08-18)

  • Port fix_build branch for indigo-devel See pull request #221
  • Contributors: Jose Luis Rivero

2.4.4 (2014-07-18)

  • Fix repo names in package.xml\'s
  • fix issue #198 Operator == is not recognized by sh scripts.
  • Add verbose parameter Add verbose parameter for --verbose gazebo flag
  • added osx support for gazebo start scripts
  • Contributors: Arn-O, Jon Binney, Markus Achtelik, Vincenzo Comito

2.4.3 (2014-05-12)

  • added osx support for gazebo start scripts
  • Remove gazebo_ros dependency on gazebo_plugins
  • Contributors: Markus Achtelik, Steven Peters

2.4.2 (2014-03-27)

  • merging from hydro-devel
  • bump patch version for indigo-devel to 2.4.1
  • merging from indigo-devel after 2.3.4 release
  • \"2.4.0\"
  • catkin_generate_changelog
  • Contributors: John Hsu

2.4.1 (2013-11-13)

2.3.5 (2014-03-26)

  • gazebo_ros: [less-than-minor] fix newlines
  • gazebo_ros: remove assignment to self If this is needed for any twisted reason, it should be made clear anyway. Assuming this line is harmless and removing it because it generates cppcheck warnings.
  • Contributors: Paul Mathieu

2.3.4 (2013-11-13)

  • rerelease because sdformat became libsdformat, but we also based change on 2.3.4 in hydro-devel.
  • remove debug statement
  • fix sdf spawn with initial pose
  • fix sdf spawn with initial pose
  • Merge branch \'hydro-devel\' into spawn_model_pose_fix
  • fix indentation
  • Merge pull request #142 from hsu/hydro-devel fix issue #38, gui segfault on model deletion
  • Merge pull request #140 from v4hn/spawn_model_sleep replace time.sleep by rospy.Rate.sleep
  • fix spawn initial pose. When model has a non-zero initial pose and user specified initial model spawn pose, add the two.
  • fix issue #38, gui segfault on model deletion by removing an obsolete call to set selected object state to \"normal\".
  • replace time.sleep by rospy.Rate.sleep time was not even imported, so I don\'t know why this could ever have worked...
  • Add time import When using the -wait option the script fails because is missing the time import
  • Use pre-increment for iterators
  • Fix iterator erase() problems

2.4.0 (2013-10-14)

2.3.3 (2013-10-10)

  • Cleaned up unnecessary debug output that was recently added
  • Fixed issue where catkin_find returns more than one library if it is installed from both source and debian

2.3.2 (2013-09-19)

  • Make gazebo includes use full path In the next release of gazebo, it will be required to use the full path for include files. For example, [include <physics/physics.hh>]{.title-ref} will not be valid [include <gazebo/physics/physics.hh>]{.title-ref} must be done instead.
  • update gazebo includes
  • Fixed a minor typo in spawn_model error message when [-model]{.title-ref} not specified

2.3.1 (2013-08-27)

  • Cleaned up template, fixes for header files

2.3.0 (2013-08-12)

  • gazebo_ros: fixed missing dependency on TinyXML
  • gazebo_plugins: replace deprecated boost function This is related to this gazebo issue

2.2.1 (2013-07-29)

2.2.0 (2013-07-29)

  • Switched to pcl_conversions
  • Remove find_package(SDF) from CMakeLists.txt It is sufficient to find gazebo, which will export the information about the SDFormat package.

2.1.5 (2013-07-18)

  • gazebo_ros: fixed variable names in gazebo_ros_paths_plugin

2.1.4 (2013-07-14)

2.1.3 (2013-07-13)

2.1.2 (2013-07-12)

  • Added author
  • Tweak to make SDFConfig.cmake
  • Cleaned up CMakeLists.txt for all gazebo_ros_pkgs
  • Cleaned up gazebo_ros_paths_plugin
  • 2.1.1

2.1.1 (2013-07-10 19:11)

  • Merge branch \'hydro-devel\' of github.com:ros-simulation/gazebo_ros_pkgs into hydro-devel
  • Reduced number of debug msgs
  • Fixed physics dynamic reconfigure namespace
  • gazebo_ros_api_plugin: set [plugin_loaded_]{.title-ref} flag to true in GazeboRosApiPlugin::Load() function
  • Actually we need [__init__.py]{.title-ref}
  • Cleaning up code
  • Moved gazebo_interface.py from gazebo/ folder to gazebo_ros/ folder
  • Removed searching for plugins under \'gazebo\' pkg because of rospack warnings
  • Minor print modification
  • Added dependency to prevent missing msg header, cleaned up CMakeLists

2.1.0 (2013-06-27)

  • gazebo_ros: added deprecated warning for packages that use gazebo as package name for exported paths
  • Hiding some debug info
  • gazebo_ros: use rosrun in debug script, as rospack find gazebo_ros returns the wrong path in install space
  • Hide Model XML debut output to console
  • gazebo_ros_api_plugin.h is no longer exposed in the include folder
  • Added args to launch files, documentation
  • Merge pull request #28 from osrf/no_roscore_handling Better handling of gazebo_ros run when no roscore started
  • gazebo_ros: also support gazebo instead of gazebo_ros as package name for plugin_path, gazebo_model_path or gazebo_media_path exports
  • gazebo_plugins/gazebo_ros: fixed install directories for include files and gazebo scripts
  • changed comment location
  • added block comments for walkChildAddRobotNamespace
  • SDF and URDF now set robotNamespace for plugins
  • Better handling of gazebo_ros run when no roscore started

2.0.2 (2013-06-20)

  • Added Gazebo dependency
  • changed the final kill to send a SIGINT and ensure only the last background process is killed.
  • modified script to work in bash correctly (tested on ubuntu 12.04 LTS)

2.0.1 (2013-06-19)

  • Incremented version to 2.0.1
  • Fixed circular dependency, removed deprecated pkgs since its a stand alone pkg
  • Shortened line lengths of function headers

2.0.0 (2013-06-18)

  • Changed version to 2.0.0 based on gazebo_simulator being 1.0.0
  • Updated package.xml files for ros.org documentation purposes
  • Combined updateSDFModelPose and updateSDFName, added ability to spawn SDFs from model database, updates SDF version to lastest in parts of code, updated the tests
  • Renamed Gazebo model to SDF model, added ability to spawn from online database
  • Fixed really obvious error checking bug
  • Deprecated -gazebo arg in favor of -sdf tag
  • Reordered services and messages to be organized and reflect documentation. No code change
  • Cleaned up file, addded debug info
  • Merged changes from Atlas ROS plugins, cleaned up headers
  • Small fixes per ffurrer\'s code review
  • Deprecated warnings fixes
  • Cleaned up comment blocks - removed from .cpp and added to .h
  • Merged branches and more small cleanups
  • Small compile error fix
  • Standardized function and variable naming convention, cleaned up function comments
  • Reduced debug output and refresh frequency of robot spawner
  • Converted all non-Gazebo pointers to boost shared_ptrs
  • Removed old Gazebo XML handling functions - has been replaced by SDF, various code cleanup
  • Removed the physics reconfigure node handle, switched to async ROS spinner, reduced required while loops
  • Fixed shutdown segfault, renamed [rosnode_]{.title-ref} to [nh_]{.title-ref}, made all member variables have [_]{.title-ref} at end, formatted functions
  • Added small comment
  • adding install for gazebo_ros launchfiles
  • Formatted files to be double space indent per ROS standards
  • Started fixing thread issues
  • Fixing install script names and adding gzserver and gdbrun to install command
  • Fixed deprecated warnings, auto formatted file
  • Cleaned up status messages
  • Added -h -help --help arguemnts to spawn_model
  • Removed broken worlds
  • Removed deprecated namespace argument
  • Using pkg-config to find the script installation path. Corrected a bash typo with client_final variable in gazebo script.
  • Cleaning up world files
  • Deprecated fix
  • Moved from gazebo_worlds
  • Cleaning up launch files
  • Moved from gazebo_worlds
  • Fixing renaming errors
  • Updated launch and world files and moved to gazebo_ros
  • Combined gzclient and gzserver
  • Added finished loading msg
  • All packages building in Groovy/Catkin
  • Imported from bitbucket.org

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ainstein_radar_gazebo_plugins github-AinsteinAI-ainstein_radar
astrobee_gazebo github-nasa-astrobee
ati_force_torque github-KITrobotics-ati_force_torque
audibot_gazebo github-robustify-audibot
blender_gazebo github-david0429-blender_gazebo
clover_description github-CopterExpress-clover
clover_simulation github-CopterExpress-clover
cob_description github-ipa320-cob_common
raw_description github-ipa320-cob_common
cob_gazebo_plugins github-ipa320-cob_gazebo_plugins
cob_gazebo_ros_control github-ipa320-cob_gazebo_plugins
cob_bringup_sim github-ipa320-cob_simulation
cob_gazebo github-ipa320-cob_simulation
cob_gazebo_objects github-ipa320-cob_simulation
cob_gazebo_worlds github-ipa320-cob_simulation
desistek_saga_description github-uuvsimulator-desistek_saga
dingo_gazebo github-dingo-cpr-dingo_simulator
eca_a9_description github-uuvsimulator-eca_a9
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetchit_challenge github-fetchrobotics-fetch_gazebo
franka_gazebo github-frankaemika-franka_ros
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_control github-ros-simulation-gazebo_ros_pkgs
gazebo_ros_pkgs github-ros-simulation-gazebo_ros_pkgs
gazebo_video_monitor_plugins github-nlamprian-gazebo_video_monitors
gundam_rx78_gazebo github-gundam-global-challenge-gundam_robot
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_gazebo_worlds github-tu-darmstadt-ros-pkg-hector_gazebo
heron_gazebo github-heron-heron_simulator
husky_gazebo github-husky-husky
igvc_self_drive_gazebo github-robustify-igvc_self_drive_sim
igvc_self_drive_gazebo_plugins github-robustify-igvc_self_drive_sim
jackal_gazebo github-jackal-jackal_simulator
eusurdf github-jsk-ros-pkg-jsk_model_tools
khi_rs_gazebo github-Kawasaki-Robotics-khi_robot
kobuki_gazebo github-yujinrobot-kobuki_desktop
kobuki_gazebo_plugins github-yujinrobot-kobuki_desktop
lauv_description github-uuvsimulator-lauv_gazebo
leo_gazebo github-LeoRover-leo_simulator
mir_gazebo github-DFKI-NI-mir_robot
moose_gazebo github-moose-cpr-moose_simulator
mrp2_gazebo github-milvusrobotics-mrp2_simulator
nmea_gps_plugin github-OUXT-Polaris-nmea_gps_plugin
open_manipulator_p_gazebo github-ROBOTIS-GIT-open_manipulator_p_simulations
open_manipulator_gazebo github-ROBOTIS-GIT-open_manipulator_simulations
open_manipulator_with_tb3_gazebo github-ROBOTIS-GIT-open_manipulator_with_tb3_simulations
prbt_gazebo github-PilzDE-pilz_robots
pouco2000_ros_gazebo github-PoussPouss-pouco2000
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
raspimouse_gazebo github-rt-net-raspimouse_sim
rexrov2_control github-uuvsimulator-rexrov2
rexrov2_description github-uuvsimulator-rexrov2
ridgeback_gazebo github-ridgeback-ridgeback_simulator
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
roboticsgroup_upatras_gazebo_plugins github-roboticsgroup-roboticsgroup_upatras_gazebo_plugins
robotont_gazebo github-robotont-robotont_gazebo
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rr_openrover_description github-RoverRobotics-rr_openrover_stack
rr_openrover_simulation github-RoverRobotics-rr_openrover_stack
nextage_calibration github-tork-a-rtmros_nextage
nextage_gazebo github-tork-a-rtmros_nextage
seed_r7_gazebo github-seed-solutions-seed_r7_ros_pkg
sr_hand github-shadow-robot-sr_core
sr_tactile_sensors github-shadow-robot-sr_core
staubli_rx160_gazebo github-ros-industrial-staubli_experimental
staubli_tx60_gazebo github-ros-industrial-staubli_experimental
staubli_tx90_gazebo github-ros-industrial-staubli_experimental
tork_moveit_tutorial github-tork-a-tork_moveit_tutorial
turtlebot3_gazebo github-ROBOTIS-GIT-turtlebot3_simulations
baylands github-osrf-uav_testing
ksql_airport github-osrf-uav_testing
mcmillan_airfield github-osrf-uav_testing
sand_island github-osrf-uav_testing
yosemite_valley github-osrf-uav_testing
ur_gazebo github-ros-industrial-universal_robot
uos_gazebo_worlds github-uos-uos_tools
urdf_sim_tutorial github-ros-urdf_sim_tutorial
uuv_descriptions github-uuvsimulator-uuv_simulator
uuv_gazebo_worlds github-uuvsimulator-uuv_simulator
uuv_tutorial_seabed_world github-uuvsimulator-uuv_simulator
velodyne_gazebo_plugin github-beltransen-velo2cam_gazebo
velodyne_gazebo_plugins bitbucket-DataspeedInc-velodyne_simulator
volta_simulation github-botsync-volta_simulation
warthog_gazebo github-warthog-cpr-warthog_simulator

Launch files

  • launch/willowgarage_world.launch
  • launch/empty_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: false]
      • output [default: screen]
      • world_name [default: worlds/empty.world]
      • respawn_gazebo [default: false]
      • use_clock_frequency [default: false]
      • pub_clock_frequency [default: 100]
      • enable_ros_network [default: true]
      • server_required [default: false]
      • gui_required [default: false]
  • launch/range_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world [default: gazebo_ros_range]
  • launch/elevator_world.launch
      • paused [default: false]
      • use_sim_time [default: true]
      • extra_gazebo_args [default: ]
      • gui [default: true]
      • recording [default: false]
      • headless [default: false]
      • debug [default: false]
      • physics [default: ode]
      • verbose [default: true]
      • output [default: screen]
      • world_name [default: worlds/elevator_ros.world]
  • launch/mud_world.launch
  • launch/rubble_world.launch
  • launch/shapes_world.launch

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged gazebo_ros at Robotics Stack Exchange