Highlights
-
Fortress/Garden
: Additional convenience classes: Actor, Joint, Light, and Sensor. These classes provide a more object-oriented interface to the Entity Component Manager and would be familiar to Gazebo-classic users. We’ve also created tutorials on migrating the Actor, Joint, Light, and Sensor classes from gazebo classic -
Garden
: Gazebo now uses a more aggressive low-pass filter which makes the RTF display more stable and reflect the RTF of a longer window of time. gz-sim#1942
-
Fortress
/Garden
: Adds a simple camera FPS plugin to show the GUI camera’s framerate. gz-gui#523
-
Garden
: The Reset button has been added to world_control. Note that you need to update yourgui.config
to match the new width of the world_control widget. Alternatively, you can remove~/.gz/sim/7/gui.config
and a new one will be created for you. SDFormat files that have<gui>
tags will also need to be updated with the new width. gz-sim#476
-
Garden
: Support for airspeed sensor has been added in gz-sim#1847 -
Garden
: Support for bayer images to has been added to Ogre and Ogre2 in gz-rendering#838
-
Garden
: Actuators message input for JointController, JointPositionController, Ackermann Steering. This adds the ability to control multiple joints with a single message. gz-sim#1953 -
Garden
: Performance improvements to rendering sensors gz-sim#1938 -
Garden
: Support for fluid added mass is complete gz-sim#1592 -
Citadel
: The Resource Spawner load time has been significantly improved by fetching the model list asynchronously gz-sim#1962 -
Citadel/Fortress/Garden
: Passstd::function
by value toNode::Subscribe
gz-transport#382. This allows users to pass lambdas directly toNode::Subscribe
like so:transport::Node node; node.Subscribe([](const Foo& msg) { // do something with msg return; });
-
Garden
: Fixed a bug in how fixed joints are handled when URDF files are converted to SDFormat sdformat#1238.libsdformat
now also gives more specific warnings during conversion when it encounters links with no inertia or zero mass. A tutorial on the parameters that affect URDF->SDFormat conversion is now also available.
Releases
These are the minor and patch releases that came out since the previous post.
Gazebo Cmake 3.1.0, 3.2.0 and 3.2.1 (Garden)
Changelog
-
GzSetCompilerFlags: Fix detection of clang-cl
-
Add support for adding cmake extras to packages
-
Build examples using native CMake
-
Add optional binary relocatability in downstream libraries
-
Changes up to 2.17.0
Contributors
Benjamin Perseghetti
Ian Chen
Jorge Perez
Jose Luis Rivero
Michael Carroll
Silvio Traversaro
Steve Peters
Gazebo Cmake 2.17.0 (Citadel and Fortress)
Changelog
-
Use CONFIG in gz_add_benchmark to avoid Windows collisions
-
Fix FindAVDEVICE.cmake in case without pkg-config installed with ffmpeg >= 5.1
Contributors
Jorge Perez
Jose Luis Rivero
Silvio Traversaro
Steve Peters
Gazebo Common 5.4.0 (Garden)
Changelog
-
Add support for bayer images to be saved in a directory
-
Update common5 for bazel builds
-
Fixed metalness/roughness in ASSIMP loader
-
Fix Capsule mesh generation
-
Changes up to 4.7.0
Contributors
Addisu Z. Taddese
Alejandro Hernández Cordero
Ben Wolsieffer
Ian Chen
Konstantinos Chatzilygeroudis
Michael Carroll
Nate Koenig
Steve Peters
Tejal Ashwini Barnwal
Gazebo Common 4.7.0 (Fortress)
Changelog
-
Fix for ffmpeg v6
-
Fixed MeshManager Singleton
Contributors
Addisu Z. Taddese
Alejandro Hernández Cordero
Ben Wolsieffer
Konstantinos Chatzilygeroudis
Michael Carroll
Steve Peters
Gazebo Fuel-Tools 8.0.2 (Garden)
Changelog
-
Fix model downloads for ignitionrobotics.org URIs.
-
Fix build when
JSON_USE_EXCEPTION == 0
-
Changes up to 7.2.2
Contributors
Addisu Z. Taddese
Cristóbal Arroyo
Ian Chen
Nate Koenig
Steve Peters
Gazebo Fuel-Tools 7.2.1 and 7.2.2 (Fortress)
Changelog
- Changes up-to 4.9.0
Contributors
Addisu Z. Taddese
Cristóbal Arroyo
Nate Koenig
Steve Peters
Gazebo Fuel-Tools 4.8.1, 4.8.2, 4.8.3. and 4.9.0 (Citadel)
Changelog
-
Add bash completion
-
Reflect pagination of RESTful requests in iterator API
-
Support link referral download
-
Allow Curl redirect on get.
-
Fix model downloads for ignitionrobotics.org URIs.
Contributors
Addisu Z. Taddese
Nate Koenig
Steve Peters
Gazebo Gui 7.1.0 and 7.2.0 (Garden)
Changelog
-
Add support for bayer images to get displayed in gazebo gui
-
Apply low-pass filter to RTF display
-
Added Reset button to world_control
-
Tries to fix a scenario when a user sends a malformed point cloud
-
Fix attribute update when
<dialog>
isn’t present -
Changes up to 6.8.0
Contributors
Addisu Z. Taddese
Alejandro Hernández Cordero
Arjo Chakravarty
AzulRadio
Ian Chen
Jenn Nguyen
Louise Poubel
methylDragon
Michael Carroll
Nate Koenig
Steve Peters
Tejal Ashwini Barnwal
Gazebo Gui 6.8.0 (Fortress)
Changelog
-
Add degree as an optional unit for rotation in GzPose.
-
Update cmd/CMakeLists to conform with all other gz libraries.
-
Add pointer check in Application::RemovePlugin.
-
Add Camera FPS plugin.
-
Fix data race issues in CameraTracking plugin.
Contributors
Addisu Z. Taddese
AzulRadio
Ian Chen
Jenn Nguyen
Louise Poubel
methylDragon
Nate Koenig
Steve Peters
Gazebo Math 6.14.0 (Citadel and Fortress)
Changelog
-
Disable pybind11 on windows by default
-
Add option to skip pybind11 and SWIG
-
Custom PID error rate
Contributors
Addisu Z. Taddese
Michael Carroll
Nate Koenig
Steve Peters
Gazebo Msgs 9.3.0 and 9.4.0 (Garden)
Changelog
-
Support for bazel in garden
-
Add entity wrench map
-
Added airspeed sensor
-
Fix cross-compilation workflow
Contributors
Alejandro Hernández Cordero
Arjo Chakravarty
Carlos Agüero
Ian Chen
Michael Carroll
Rhys Mainwaring
Silvio Traversaro
Gazebo Physics 6.3.0, 6.3.1, 6.3.2, and 6.4.0 (Garden)
Changelog
-
dartsim: Add support for joints in worlds
-
Bullet featherstone: Add JointTransmittedWrench for F-T sensor
-
Support multiple collisions per link in bullet-featherstone
-
Fix bullet related segfaults on macOS
-
dartsim: Refactor entity addition logic in the EntityStorage class
-
Fix a crash due to an invalid pointer
-
Fix joint index used in bookkeeping
-
Resolve joints in nested models
-
Apply gravity external to dartsim for added mass
-
Install the common test executables to libexec
-
[bullet]: Fix how changed link poses are computed
-
Changes up to 5.3.1
Contributors
Addisu Z. Taddese
Aditya Pande
Alejandro Hernández Cordero
Louise Poubel
methylDragon
Michael Carroll
Nate Koenig
Rhys Mainwaring
Steve Peters
Gazebo Physics 5.3.1 (Fortress)
Changelog
- Fix memory corruption due to faulty refcount tracking
Contributors
Addisu Z. Taddese
Steve Peters
Gazebo Rendering 7.3.0, 7.3.1, and 7.4.0 (Garden)
Changelog
-
Add optional binary relocatability
-
Add Projector
-
Add support for bayer images to Ogre and Ogre2
-
Fix requiring OpenGL on macOS
-
Lower severity level for ogre2 visibility mask msgs and unavailable render passes
-
Fix deleting ogre2 when created (and deleted) in a thread
-
Add message to see troubleshooting page when render engine fails to create dummy window
-
Limit max camera position vector length
-
Cleanup GpuRays properly
-
Ensure composite BaseVisuals are destroyed correctly.
-
Mesh cleanup on destruction
-
Fix gpu lidar memory leak [ogre2]
-
Fix selecting semi-transparent visuals
-
Fix Ogre2DepthCamera on macOS (Fortress)
-
Add Heightmap integration test
-
Restore GLX context after OGRE plugin loading finishes.
-
Do not overwrite reserved visibility flags in ogre2
-
Fix Metal shader compiler error in GpuRays (Lidar)
-
Fix memory corruption in Ogre2GpuRays
-
Enable ray heightmap ray query
-
Fix RenderTarget::destroy not getting called in both ogre1 & ogre2
-
Implement consistent Auto Aspect Ratio
-
Fix bounding box for glbs
-
Use proper sRGB conversion in DepthCamera
-
Enable Heightmap Test for ogre2 & fix crash when using GpuRays camera
-
Fix non-deterministic rendering due to background texture loading
-
Fix lidar heightmap detection
-
Changes up to 6.6.0
Contributors
Alejandro Hernández Cordero
Ian Chen
Martin Pecka
Matias N. Goldberg
methylDragon
Michael Carroll
Nate Koenig
Rhys Mainwaring
Silvio Traversaro
Steve Peters
Tejal Ashwini Barnwal
Gazebo Rendering 6.6.0 (Fortress)
Changelog
-
Backport Composite BaseVisual destroy fix to 6
-
Fix transparency over heightmap
-
Fix duplicate PreRrender calls
-
Changes up to 3.7.1
Contributors
Alejandro Hernández Cordero
Ian Chen
methylDragon
Michael Carroll
Nate Koenig
Gazebo Rendering 3.7.1 (Citadel)
Changelog
- Remove fini to resolve segfault at shutdown.
Contributors
Nate Koenig
Gazebo Sensors 7.1.0 and 7.2.0 (Garden)
Changelog
-
Cleanup resources in CameraSensor destructor
-
Added trigger to BoundingBoxCamera
-
Clean up rendering resources
-
Added Camera Info topic support for cameras
-
Added airspeed sensor
-
Set custom projection matrix based on intrinsics params from SDF
-
Renamed
ignition_frame_id
togz_frame_id
and fix warning -
Update Camera Intrinsics in camera_info topic
-
Changes up to 6.7.0
Contributors
Addisu Z. Taddese
Aditya Pande
Alejandro Hernández Cordero
Alex
Brian
Ian Chen
Louise Poubel
Marq Rasmussen
methylDragon
Michael Carroll
Michel Hidalgo
Nate Koenig
quentingllmt
Steve Peters
Valentina Vasco
Gazebo Sensors 6.7.0 (Fortress)
Changelog
-
Add optional optical frame id to camera sensors.
-
Add support for 16 bit image format.
-
Fix navsat frame id.
-
CameraInfo is now published when there’s a CameraSensor subscriber.
-
Add HasInfoConnections() method to expose infoPub.HasConnections() to
child of CameraSensor class.
Contributors
Alejandro Hernández Cordero
Alex
Brian
Ian Chen
Jenn Nguyen
Jorge Perez
Louise Poubel
Marq Rasmussen
methylDragon
Nate Koenig
Steve Peters
Gazebo Sim 7.3.0, 7.4.0, and 7.5.0 (Garden)
Changelog
-
Actuators message input for JointController, JointPositionController, Ackermann Steering
-
Add missing cmake exports from core library
-
Update sdf plugins to use actuator_number.
-
Unload render engine when the sensors system exits
-
Use GzSpinBox instead of IgnSpinBox in ViewAngle plugin.
-
Add tutorial on migrating the Actor, Joint, and Light classes from gazebo classic
-
Optimize render updates and use of thread mutexes in Sensors system
-
Fix use of actors that only has trajectory animation
-
Remove filtering from realtime factor (RTF) calculation
-
Fix docker/README.md
-
Use a queue to track component registration from mulitiple sources
-
Initialize services in ViewAngle constructor
-
Add comment on center of buoyancy force
-
Add convenience classes: Actor, Joint, Light, and Sensor
-
Resolve inconsistent visibility on ign-gazebo6
-
Fix formatting of error messages with large mesh file names
-
Update all velocity and acceleration components of non-link entities
-
Allow to change camera user hfov in camera_view plugin
-
Added magnetometer value based on location
-
Allow specifying initial simulation time with a CLI argument
-
Add Joint class
-
Added reset simulation tutorial
-
Add SensorTopic component to rendering sensors
-
Inherit material cast shadows property
-
Remove actors from screen when they are supposed to
-
Added airspeed sensor
-
JointPosController: support nested joints
-
Fluid added mass
-
Add P gain value for Ackermann steering.
-
Add orientation to Odom with covariance.
Contributors
Addisu Z. Taddese
Alejandro Hernández Cordero
Anas Aamoum
Arjo Chakravarty
AzulRadio
Benjamin Perseghetti
Carlos Agüero
Cristóbal Arroyo
El Jawad Alaa
Ian Chen
Jenn Nguyen
Joan Aguilar Mayans
Louise Poubel
Mabel Zhang
Matthew LeMay
methylDragon
Michael Carroll
Nate Koenig
Onur Berk Töre
Rhys Mainwaring
Steve Peters
Gazebo Sim 3.15.0 (Citadel)
Changelog
-
Speed up Resource Spawner load time by fetching model list asynchronously
-
Fix loading wold with record topic
-
Remove duplicate Fuel server used by ResourceSpawner
-
Re-add namespace for GUI render event
-
Fix QML warnings regarding binding loops
-
Update documentation on
UpdateInfo::realTime
-
Remove plotIcon in Physics.qml for Component Inspector
-
Added collection name to About Dialog
-
Remove actors from screen when they are supposed to
Contributors
Addisu Z. Taddese
Alejandro Hernández Cordero
Arjo Chakravarty
AzulRadio
Ian Chen
Jenn Nguyen
methylDragon
Nate Koenig
Steve Peters
Gazebo Transport 12.2.0 (Garden)
Changelog
-
Support clang and std::filesystem
-
Pass std::function by value to Node::Subscribe
-
Prevent invoking callbacks after a node unsubscribes to a topic
-
Fix CLI configuration install path to ignition
-
Changes up to 11.4.0
Contributors
Carlos Agüero
Ian Chen
Michael Carroll
Nate Koenig
Steve Peters
Gazebo Transport 11.4.0 (Fortress)
Changelog
- Added Node::RequestRaw
Contributors
Michael Carroll
Nate Koenig
SDFormat 13.3.0, 13.4.0, 13.4.1, and 13.5.0 (Garden)
Changelog
-
Added projector Python wrapper
-
Added new error codes in Python
-
Add missing element
visualize
in 1.9/light.sdf -
Add Projector DOM
-
Update libsdformat APIs to use sdf::Errors parameters instead of printing errors to the console.
- Several PRs tracked by: Explicitly delimit EOM for logging · Issue #820 · gazebosim/sdformat · GitHub
-
Fix Element::Set method return value
-
Add missing values in Surface ToElement method
-
URDF->SDF handle links with no inertia or small mass
-
Allowing relative paths in URDF
-
Fix camera_info_topic default value
-
Add support for merge-includes in worlds
-
Backport the python3 embedSdf script variant
-
Add missing sdf files from xsd generation
-
Add airspeed sensor
-
Warn child joint that resolves to world
-
ParamPassing: sdfwarns to sdf::Errors when warnings policy set to sdf::EnforcementPolicy::ERR
-
Camera: added HasLensProjection
-
Change default
camera_info_topic
value to__default__
-
Check JointAxis expressed-in values during Load
-
Added camera info topic to Camera
-
Fix static URDF models with fixed joints
-
Changes up to 12.7.1
Contributors
Aaron Chong
Addisu Z. Taddese
Alejandro Hernández Cordero
Ben Wolsieffer
Ian Chen
Liam Han
Marco A. Gutierrez
methylDragon
Michael Carroll
Nate Koenig
Robert Plante
Steve Peters
Tejal Ashwini Barnwal
Vít Ondruch
SDFormat 12.7.0 and 12.7.1 (Fortress)
Changelog
- Fix camera info topic default value
Contributors
Alejandro Hernández Cordero
Ben Wolsieffer
Ian Chen
methylDragon
Nate Koenig
Steve Peters
Vít Ondruch