-
Update github action workflows
-
Fix macOS test failures by registering components in the core library
-
Bump Fuel model version in test
-
Fix a minor issue in the documentation of the server API
-
Use sdf::Element::FindElement instead of GetElement in ApplyLinkWrench
-
Adds a warning if the
Server
method of aTestFixture
is called beforeFinalize
-
Protobuf: Do not require version 3 do support Protobuf 4.23.2 (23.2)
-
Print an error message when trying to load SDF files that don't contain a
<world>
-
Enable GzWeb visualization of markers by republishing service requests on a topic
-
Speed up Resource Spawner load time by fetching model list asynchronously
-
ign -> gz Migrate Ignition Headers : gz-sim
-
Infrastructure
-
Backport portion of #1771 to fix command-line test
-
cmdsim.rb: fix ruby syntax
-
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
-
Add jennuine as GUI codeowner
-
Remove plotIcon in Physics.qml for Component Inspector
-
Convert ignitionrobotics to gazebosim in tutorials
-
Added collection name to About Dialog
-
Remove compiler warnings
-
Update examples to use gazebosim.org
-
Remove actors from screen when they are supposed to
-
Readd namespaces for Q_ARGS
-
Change
CODEOWNERS
and maintainer to Michael -
Replace pose in
ViewAngle
withGzPose
-
Fix loading worlds from CLI
-
Quick start dialog
-
Quiet
libSDFormat
console on --verbose 0 -
Add Ackermann Steering system (backport from Fortress)
-
New Apply Link Wrench system
-
Implement Component Inspector
Vector3
with common widgetVector3
-
Helper function to get an entity from an entity message
-
Ignition -> Gazebo
-
Add Model::CanonicalLink getter
-
Implement Pose3d with common widget pose
-
Test fixes and updates
-
Bash completion for flags
-
Add new
GZ_GUI_RESOURCE_PATH
to help message
-
Extruded 2D polyline geometries
-
Add elevator system
-
Add desktop entry and svg logo
-
Delete unused
gazebo.hh.in
-
Add repo specific issue templates
-
Added user command to set multiple entities' poses
-
Component inspector: refactor Pose3d C++ code into a separate class
-
Added more sensor properties to
scene/info
topic -
JointStatePublisher
publish parent, child and axis data -
Removed unused variables in shapes plugin
-
Log an error if
JointPositionController
cannot find the joint. (citadel retarget) -
Buoyancy
: fix center of volume's reference frame -
Remove
EachNew
calls from sensor PreUpdates -
Prevent
GzScene3D
💥 if another scene is already loaded -
Add
project()
call to examples -
Implement
/server_control::stop
-
👩🌾 Make depth camera tests more robust
-
Make tests run as fast as possible
-
Prevent creation of spurious
<plugin>
elements when saving worlds -
Added support for tracked vehicles
-
Add components to dynamically set joint limits
-
Fix updating a component's data via SerializedState msg
-
Sensor systems work if loaded after sensors
-
Fix generation of systems library symlinks in build directory
-
Backport sim::Util::validTopic() from ign-gazebo4.
-
Support setting the background color for sensors
-
Use uint64_t for ComponentInspector Entity IDs
-
Fix integers and floats on component inspector
- Updates to camera video record from subt.
- Fix performance level test flakiness.
-
Performance: use std::unordered_map where possible in SceneManager
-
Enable new CMake policy to fix protobuf compilation
-
Fix setting cast_shadows for visuals without material
-
Remove duplicate XML tag in pendulum_links example world
-
Enable sensor metrics on example worlds
-
Improved doxygen
-
JointPositionController: Improve misleading error message
-
Adjust pose decimals based on element width
-
Fixed IMU system plugin
-
Use QTimer to update plugins in the Qt thread
-
Entity tree: prevent creation of repeated entity items
-
Don't use $HOME on most tests (InternalFixture)
-
Be more specific when looking for physics plugins
-
Drag and drop meshes into scene
-
Set protobuf_MODULE_COMPATIBLE before any find_package call
-
[DiffDrive] add enable/disable
-
Fix component inspector shutdown crash
-
Add UserCommands Plugin.
-
Setting the intiial velocity for a model or joint
-
Examples and tutorial on using rendering API from plugins
-
Add missing IGNITION_GAZEBO_VISIBLE macros
-
Fix visibility macro names when used by a different component (Windows)
-
No install apt recommends and clear cache
-
Add 25percent darker view angle icons
-
Expose a test fixture helper class
-
Fix logic to disable server default plugins loading
-
removed unneeded plugin update
-
Functions to enable velocity and acceleration checks on Link
-
Support adding systems that don't come from a plugin
-
3D plot GUI plugin
-
Add a convenience function for getting possibly non-existing components.
-
Fix topLevelModel method
-
World exporter
-
Fix finding PBR materials
-
Handle multiple logical cameras
-
Make some tests more robust
-
Fix codecheck
-
Hello world plugin added
-
Model info CLI
ign model
-
Don't create components for entities that don't exist
-
Adds Mesh Tutorial
-
Fix updating GUI plugin on load
-
Fix documentation for the Sensor component
-
Use UINT64_MAX for kComponentTpyeIDInvalid instead of relying on underflow
-
Fix mouse view control target position
-
Set GUI camera pose
-
Enables confirmation dialog when closing Gazebo.
-
Depend on ign-rendering 3.5
-
Using math::SpeedLimiter on the diff_drive controller.
-
New example: get an ECM snapshot from an external program
-
Fix WindEffects Plugin bug, not configuring new links
-
Fix potentially flaky integration component test case
-
Cleanup and alphabetize plugin headers
-
Removed duplicated code with rendering::sceneFromFirstRenderEngine
-
Remove unused headers in video_recoder plugin
-
Use moveToHelper from ign-rendering
-
Remove tools/code_check and update codecov
-
Add service and GUI to configure physics parameters
-
Fix documentation for EntityComponentManager::EachNew
-
Fix macOS build: components::Name in benchmark
-
Don't store duplicate ComponentTypeId in ECM
-
[TPE] Support setting individual link velocity
-
👩🌾 Enable Focal CI
-
Update benchmark comparison instructions
-
Use Protobuf_IMPORT_DIRS instead of PROTOBUF_IMPORT_DIRS for compatibility with Protobuf CMake config
-
Do not pass -Wno-unused-parameter to MSVC compiler
-
Scenebroadcaster sensors
-
Make it so joint state publisher is quieter
-
Add joint position controller GUI, also enable tests for GUI plugins
-
Remove visibility from headers that are not installed
-
Added screenshot to toolbar
-
Improve ign tool support on macOS
-
change nullptr to a int ptr for qt 5.15.2 bug
-
Kinetic energy monitor plugin
-
Use a std::promise/std::future to avoid busy waiting the step ack messages in NetworkManagerPrimary
-
clarified performer example
-
Add tutorial tweaks
-
Fix Qt5 warnings for using anchors
-
Update codeowners
-
Qt auto scale factor for HiDPI displays
-
Fix yaw units
-
Fixed docblock showGrid
-
Fix entity tree for large worlds
-
Master branch updates
-
Backport #561: Use common::setenv
-
Use a custom data structure to manage entity feature maps
-
Limit scene broadcast publications when paused
-
Fix flaky SceneBoradcaster test
-
Add TF/Pose_V publisher in DiffDrive
-
👩🌾 Relax performance test
-
👩🌾 Improve velocity control test
-
Add
laser_retro
support -
Fix pose of plane visual with non-default normal vector
-
Add About dialog
-
Make topics configurable for joint controllers
-
Also use Ignition GUI render event
-
Tutorial on migrating SDF files from Gazebo classic
-
Visualize collisions
-
Backport state update changes from pull request #486
-
Publish all periodic change components in Scene Broadcaster
-
added size to
ground_plane
in examples -
Parallelize State call in ECM
-
Non-blocking paths request
-
Fix examples in migration plugins tutorial.
-
Added missing namespace in
detail/EntityComponentManager.hh
. -
Automatically load a subset of world plugins.
-
Update gtest to 1.10.0 for Windows compilation.
-
Updates to ardupilot migration tutorial.
-
Don't make docs on macOS.
-
Fix pose msg conversion when msg is missing orientation
-
Address code checker warnings
-
Test fixes
-
Documentation updates
-
Fix segfault in the Breadcrumb system when associated model is unloaded
-
Added user commands to example thermal camera world
-
Helper function to set component data
-
Remove unneeded if statement in EntityComponentManager
-
Clarify how time is represented in each phase of a System step
-
Switch to async state service request
-
Update key event handling
-
Tape Measure Plugin
-
Move deselect and preview termination to render thread
-
Logical audio sensor plugin
-
add frame_id and child_frame_id attribute support for DiffDrive
-
Add ability to record video based on sim time
-
Add lockstep mode to video recording
-
Disable right click menu when using measuring tool
-
Updated source build instructions
-
More world APIs, helper function ComponentData
-
Improve fork experience
-
Fix a crash in the grid config plugin, set grid material
-
Document deprecation of log playback
<path>
SDF param -
Enable mouse highlighting selection on resource spawner
-
Add support for custom render engines
-
Component Vector -> Map ECM Optimization
-
Fix gui sendEvent memory leaks
-
Support nested models
-
Generalize actor count and pose in actor population erb SDF
-
Add more link APIs, with tutorial
-
Add screenshots to GUI config tutorial
-
Fix adding performers to entity tree
-
Remove sidebar and put world control in bottom left for joint controller examples
-
Allow executing a blocking single Server run in both paused and unpaused states
-
Add camera video recorder system
-
Decrease time step for quadcopter world
-
Add support for moving the GUI camera to a pose
-
Remove
lib
+.so
from plugin's name -
EntityComponentManager::EachRemoved documentation fix.
-
Add more model APIs.
-
Update dimensions of the grid config.
-
Fix top-left toolbar layout so magnet shows.
-
Add instructions to bitmask world.
-
Add search and sort for resource spawner.
-
Fix source build instructions for ign-gazebo3.
-
Added playback scrubber GUI
-
Added wheel slip system plugin.
-
Enhanced log playback performance.
-
Tests & Warnings: Qt 5.14, breadcrumbs, Gui, gz_TEST
-
Added support for specifying topics to record.
-
Make sure OpenGL core profile context is used by GzScene3D.
-
Support relative paths for PBR materials
-
Add file extension automatically for record plugin.
-
Support spawning during log playback.
-
Added wheel slip system plugin.
-
Add Render Engine Cmd Line option
-
Added marker array service.
-
Introduced a new parameter in the scene3D plugin to launch in fullscreen.
-
Fix issue #285 by adding checks for a marker's parent.
-
Fix non-specified material error.
-
Added simulation world with large number of entities.
-
Fixed parsing of the touch plugin' enabled flag.
-
Added buoyancy system plugin.
-
Implemented shift + drag = rotate in the GUI.
-
Backport collision bitmask changes
-
Added velocity command to TPE.
-
This version includes all features in Gazebo 2.23.0
- Merge ign-gazebo2 to ign-gazebo3
-
Port support for computing model bounding box in physics system
-
Add DetachableJoint: A system that initially attaches two models via a fixed joint and allows for the models to get detached during simulation via a topic.
-
Update physics state even when paused (not stepping)
-
Fix entity tree context menu position
-
Fix moving static model with link offset
-
Added Link::AddWorldWrench function that adds a wrench to a link.
-
Fix duplicate marker services and crash due to unset marker field
-
Support s from Fuel
-
Add support for thermal camera
-
Add window focus upon mouse entering the render window
-
Add example world for collide bitmask feature
-
Remove sdf element from visuals that do not emit light in the example worlds
-
Support for sdformat frame semantics
-
Support for relative path URIs for actors
-
Add rechargeable battery model
-
Add Marker Manager
-
Parse material emissive map, bump to msgs5 and transport8
-
Move function definitions to their correct locations in EntityComponentManager
-
Depend on ign-rendering3, ign-gui3, ign-sensors3
-
Rendering and Animating Actors
-
Added wheel slip system plugin.
-
Enhanced log playback performance.
-
Tests & Warnings: Qt 5.14, breadcrumbs, Gui, gz_TEST
-
Added support for specifying topics to record.
-
Make sure OpenGL core profile context is used by GzScene3D.
-
Support relative paths for PBR materials
-
Add file extension automatically for record plugin.
-
Support spawning during log playback.
-
Resource env var, with transport interface.
-
Save http URIs (fix tests)
-
Insert Local Models.
-
Modernize actions CI.
-
Sensor topics available through components and GUI.
-
Customizable layouts - fully functional.
-
Add Fuel World Support.
-
Insert Fuel Models.
-
Disable rendering tests on macOS that are known to fail.
-
Fix tests on Blueprint.
-
Publish remaining breadcrumb deployments.
-
Deactivate PerformerDetector if its parent model gets removed.
-
Backport support for s from Fuel #255
- Allow zero or more key/value pairs to be added to detection header information.
-
Added support for controlling which joints are published by the JointStatePublisher.
-
Added an additional pose offset for the performer detector plugin.
-
Fixed battery issues and updated tutorial.
- Properly add new models into the scenegraph. With this fix, when a model is spawned it will be added into the graph and resulting calls to the
scene/info
service will return a correctmsgs::Scene
.
-
Updated battery model to stop battery drain when there is no joint velocity/force command, and added a recharging trigger.
-
Fix segfault in the Breadcrumbs system
-
Added an
<odom_topic>
element to the DiffDrive system so that a custom odometry topic can be used.
-
Use updated model names for spawned models when generating SDFormat
-
Allow joint force commands (JointForceCmd) to dscharge a battery.
-
Allow renaming breadcrumb models if there is a name conflict
-
Add TriggeredPublisher system
-
Add PerformerDetector, a system for detecting when performers enter a specified region
-
Added a
/world/<world_name>/create_multiple
service that parallels the current/world/<world_name>/create
service. Thecreate_multiple
service can handle angz::msgs::EntityFactory_V
message that may contain one or more entities to spawn. -
DetachableJoint system: Add option to suppress warning about missing child model
-
Allow battery plugin to work with joint force systems.
-
Make breadcrumb static after specified time
-
Disable breadcrumbs if the
max_deployments
== 0. -
Add static pose publisher and support pose_v msg type in pose publisher system
-
Refactor Gui.hh so that the Gazebo GUI can be ran from other packages
-
Add ability to save worlds to SDFormat
-
Add window focus upon mouse entering the render window
-
Add support for computing model bounding box in physics system
-
Add DetachableJoint: A system that initially attaches two models via a fixed joint and allows for the models to get detached during simulation via a topic.
-
Update physics state even when paused (not stepping)
-
Fix entity tree context menu position
-
Fix moving static model with link offset
-
Add support for setting visual transparency through SDF
-
Add
JointPositionReset
andJointVelocityReset
components to reset the joint state. -
Logging meshes and materials
-
List plugin env vars
-
Fix protobuf / clang warnings
-
Component inspector
-
Log compress
-
Set process titles
-
Add custom user snapping
-
Add GUI to configure grid
-
Add multiple entity selection to view angle
-
Highlight selected entities
-
Log record overwrite
-
Add copyright to QML files
-
Fix shift translation bug
-
Fix seeking back in time in log playback
-
Fix the deprecated ign-gazebo command line
-
Always use the latest render texture in scene3d
-
Remove redundent messages when levels get unloaded
-
View angle plugin
-
Support breadcrumb performers
-
Drag and drop Fuel object into mouse position
-
Add hotkey keybindings
-
Use Actuator component to communicate between MulticopterVelocityControl and MulticopterMotorModel systems
-
Backport fix to insert multiple lights with same name
-
Get all component types attached to an entity
-
Fix tooltips on entity tree
-
Add Multicopter velocity controller
-
Fix crash when removing an entity being followed
-
Add option to right click and remove nodes
-
Fix jumpy log playback
-
Remove Scene3d Text anchors
-
Show grid using SDF file
-
Parse visual cast shadows and add CastShadows component
-
Update SceneBroadcaster to publish state msg for world with only static models
-
Add log video recorder
-
Rechargeable battery model
-
Add Breadcrumbs system
-
Drag models from Fuel
-
Improvements to GUI configuration
-
Prevent crash when attempting to load more than one render engine per process
-
Handle Relative URIs
-
Avoid using invalid/unsupported joints
-
Add mutex to protect views from potential concurrent access
-
Add
Link::WorldKineticEnergy
for computing total kinetic energy of a link with respect to the world frame. -
Improve steering behavior of example tracked vehicle
-
Rewind / reset and seek
-
Add Follow mode to GUI
-
Custom odom frequency in sim time
-
Add Move To gui plugin
- Use the JointSetVelocityCommand feature to set joint velocities
-
Add video recorder gui plugin
-
Vertical rays for lidar demo
-
Print world path when using cli
- Fix order of adding and removing rendering entities, and clean up mesh materials in the SceneManager.
-
Move creation of default log path to ServerConfig. This lets both console logs and state logs to be stored in the same directory. The console messages are always logged. Allow state log files to be overwritten.
-
Baseline for stereo cameras
-
Fix log playback with levels. This drops support for logs created before v2.0.0.
-
Add worker threads for System PostUpdate phase
-
Added a test runner for executing an SDF and recording simulation rates. See the
test/performance/READEM.md
file for more info.
- Clear stepMsg before populating it
-
Improve performance of Pose Publisher
-
Fix distributed sim
- The LinearBatteryPlugin system publishes battery state
- Bundle scene updates in sensor system
-
Improve physics system peformance by skipping static model updates. Components state information has been incorporated, which is used to indicate if a component change is periodic (such as through a physics update) or a one-time change (such as through a user command).
-
Add sdf parameter to battery to start draining only when robot has started moving
-
Improve SceneBroadcaster peformance by 1) Limit message generation if subscribers to pose topics are not present, 2) Set world stats message instead of copying the message, 3) Suppress scenegraph updates when there are no new entities, 4) Make better use of const functions, 5) Prevent creation of msgs::SerializedStep every PostUpdate, 6) Only serialized and transmit components that have changed.
-
The DiffDrive system publishes odometry information.
-
Allow attaching plugins to sensors from a server config.
-
Remove world name from frame_ids
-
Fix deadlock when spawning robots
-
Set default topics for rendering sensors
-
Support custom random seed from the command line.
-
RenderUtil fix bad merge: check for existing entities in GzScene3D on initialization.
-
Allow sensors to load plugins.
-
Parse and load submesh geometry in visuals.
-
Allow setting the update frequency of pose publisher.
-
Added RGBD camera sensor.
-
Fix Docker scripts.
-
Support log playback from a different path
-
RenderUtil: check for existing entities in GzScene3D on initialization.
-
SceneBroadcaster: only send pose state periodically.
-
PeerTracker: increase distributed simulation peer tracking timeout.
-
MultiCopterMotorModel: add mutex to protect motor velocity command.
-
Tweaks to example worlds
-
DiffDrive system: add topic as system parameter.
-
Log entity creation and deletion
-
Multicopter motor model
-
Fix removing selected entity
-
Collision serialization
-
Add support for moving and rotating models
-
Pose commands
-
Level performers can be added at runtime using a service call. See the levels tutorial for more information.
-
Update worlds to GzScene3D
-
Reduce logging file size
-
Update PosePublisher system to publish sensor poses and to use scoped names for frame ids
-
Fix gui plugin linking issue
-
Toolbar colors
-
Rename Scene3D gui plugin to GzScene3D
-
Fix distributed sim documentation
-
Port Scene3D gui plugin from ign-gui. Renamed to GzScene3D.
-
Entity tree UI
-
Add rendering component
-
Update Camera and DepthCamera components to use sdf::Sensor object instead of an sdf::ElementPtr.
-
Added system for gz::sensors::AirPressureSensor.
-
Support conversion and serialization of Imu components. IMU sensors are loaded from an SDF DOM object.
-
Throttle sensors update rate
-
Fix changing themes
-
Battery tweaks
-
Support conversion and serialization of PBR parameters in a material component
-
Joint state pub
-
Update Altimeter component to use sdf::Sensor object instead of an sdf::ElementPtr.
-
Update docker nightly dependencies
-
Ign tool
-
State broadcast
-
Use world statistics message on network
-
Update Magnetometer component to use sdf::Sensor object instead of an sdf::ElementPtr.
-
Fix Scene3D loading empty world
-
Support conversion and serialization of scene and light components
-
Operators instead of De/Serialize
-
Remove PIMPL from Component
-
Delay scene broadcaster transport setup
-
Report link poses from secondaries during distributed simulation, using a cache
-
Restore log playback
-
ECM changed state
-
Joint serialization
-
Use scene ambient and background color information in sensor configuration.
-
Performance benchmarking
-
Remove emissive component from visual materials
-
Serialization for more components
-
Added an SDF message to the start of log files.
-
Unify network and sync managers
-
Add PerformerLevels component
-
Distributed sim deprecate envs
-
Use ign-sensors magnetometer sensor plugin
-
Use ign-sensors altimeter sensor plugin
-
Use ign-sensors imu sensor plugin
-
Depend on ign-sensors rendering component
-
Add Wind Plugin (Ported from Gazebo classic)
-
Port battery plugin from Gazebo classic
-
Use ISO timestamp for default log path
-
Logging tutorial
-
Joystick SDF small typos
-
Add
Link
: a convenience class for interfacing with link entities -
Added LiftDragPlugin (ported from Gazebo classic)
-
Logging refactor unique path functions to ign-common
-
Added test for log record and playback.
-
Add ApplyJointForce system
-
More ign-msgs <-> SDF conversions: Inertial, Geometry, Material
-
Logging command line support
-
Remove inactive performers instead of setting static
-
Use state instead of pose in distributed simulation
-
Distributed implies levels
-
Add a basic JointController system
-
Enforce component type uniqueness
-
Clean CI: disable test known to fail on OSX
-
Logical camera topic name check
-
Added command line options to configure distributed simulation. These will replace the environment variables.
-
Add systems to queue before actually adding them to runner
-
Added a docker image that uses the ignition meta package
-
Move some design docs to tutorials
-
Disable GUI when using distributed simulation
-
Bring component type names back
-
A few tweaks to logging
-
Handle friction coefficients
-
Change private msgs namespace
-
Set tutorial titles
-
Example tunnel world
-
Conversion from chrono to ign-msgs
-
Prevent error message when using levels
-
Distributed performers running in lockstep
-
Fix documentation tagfiles
-
Convert gui library into a component
-
include wherever special int types like uint64_t are used
-
Move network internal
-
Logging / playback
-
ECM state streaming
-
Unversioned system libraries
- Use TARGET_SO_NAME to fix finding dartsim plugin
- Update gazebo version number in sdf files
- Initial release
-
Add support for joints
-
Use SimpleWrapper for more component types
-
Create EventManager and delegate System instantiation to SimulationRunner
-
Integrate ign-gui
-
Remove some build dependencies.
-
Added basic Entity class.
-
Added a basic System class.