ros_gz icon indicating copy to clipboard operation
ros_gz copied to clipboard

Integration between ROS (1 and 2) and Gazebo simulation

Results 64 ros_gz issues
Sort by recently updated
recently updated
newest added

## Desired behavior In Gazebo Classic + ROS1, there was the ability to use [`spawn_model`](https://github.com/ros-simulation/gazebo_ros_pkgs/blob/noetic-devel/gazebo_ros/scripts/spawn_model#L78) with `-J` to specify the joint values of the spawned model, albeit some [never resolved...

enhancement

## Environment * OS Version: Ubuntu 22.04 * Source or binary build? binary build by `apt`, version `iron` ## Description * Expected behavior: when `expand_gz_topic_names` is true, the namespace on...

bug

# 🎉 New feature ## Summary Extends #500 and converts the `gzserver` ROS node into a ROS component. It also adds a launch file that creates a container and loads...

# 🎉 New feature Closes #497 ## Summary - [x] Add gzserver with ability to load an SDF file or string - [ ] Add ability to load additional systems...

# 🎉 New feature ## Summary This PR runs the ROSGz bridge as a gz sim system. It's targeting ROS 2 rolling. I'll create a separate PR with some updates...

# 🎈 Release Preparation for 1.0.0 release. Comparison to 0.246.0: https://github.com/gazebosim/ros_gz/compare/0.246.0...ros2 ## General notes about our release scheme We used to have a [version scheme](https://github.com/gazebosim/ros_gz/blob/ros2/RELEASING.md#versioning) where each number in the...

# 🎉 New feature Closes #363 ## Summary Add support for SpawnEntity, DeleteEntity, & SetEntityPose services Add support for EntityFactory ## Test it Spin up a parameter bridge for the...

Forward port of PR #486 from humble to iron * Message and bridge for MaterialColor. This allows bridging MaterialColor from ROS to GZ and is important for allowing simulation users...

# 🦟 Bug fix The conversion from a gz::msgs::pose_V message to a ros2 geometry_msgs::msg::TransformStamped message what not compatible to make it a proper "tf2" message. ## Summary ## Checklist -...

## Environment * OS Version: * Source turtlebot3_simulations 2.2.6 new_gazebo latest commit "last week i/.e Feb 10 ## Description After following procedure in https://gazebosim.org/docs/harmonic/migrating_gazebo_classic_ros2_packages, successful rosdep, clone https://github.com/azeey/turtlebot3_simulations.git * Expected...

bug