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

# 🎉 New feature ## Summary Add a ROS2 version of `math::Stopwatch` that can make use of `rclcpp::Clock` and sim time via `/clock` ## Test it Check `test/test_stopwatch.cpp` for examples...

ROS 2
MBARI buoy

# 🎉 New demo ## Summary Demonstrating SDFormat XML as a robot description format instead of URDF XML using [sdformat_urdf](https://github.com/ros/sdformat_urdf) plugin. The parser takes the SDF file published on `/robot_description`...

enhancement
ROS 2
MBARI buoy

# 🎉 New feature Closes #186 ## Summary First,package.xml has `` which will make the package depend on the required ign-gazebo version based on Ros distribution and other packages can...

ROS 2

## Environment * OS Version: Ubuntu 20.04 * Source: galactic, 94abe668a8e5ef8cfad9059f9e8ce125f12415c6 ## Description ros_ign_bridge test_launch_test_ros_subscriber.launch.py fails intermittently ## Steps to reproduce 1. clone, checkout, build 2. colcon test ## Output...

bug
ROS 2

# 🎉 Add Optical Frame Publisher ## Summary This is a utility that is used frequently enough, I think that it makes sense to include here. This transforms images (and...

enhancement
ROS 2

# ➡️ Forward port Partial forward port. Port `galactic` to `ros2` Branch comparison: https://github.com/ignitionrobotics/ros_gz/compare/ros2...galactic **Note to maintainers**: Remember to **Merge** with commit (not squash-merge or rebase)

ROS 2

We recently made a performance improvement to `ign-gazebo` which broke the point cloud package. There's more detailed information on [this issue](https://github.com/ignitionrobotics/ign-gazebo/issues/36).

help wanted

Each ROS distro is paired with a specific Ignition version as described on [REP-2000](https://www.ros.org/reps/rep-2000.html). It's the same for Gazebo Classic. We make sure that `ros_ign` releases match the official version....

enhancement

@mjcarroll FYI `ros_ign_bridge` is no longer building on Ubuntu Focal armhf and Debian Buster armv8 jobs due to ignitionrobotics/ros_ign#137 * http://repositories.ros.org/status_page/ros_noetic_ufhf.html?q=REGRESSION * http://repositories.ros.org/status_page/ros_noetic_dbv8.html?q=REGRESSION On these platforms it [appears to find...

bug
ROS 1

If you run a bridge to publish joint_states from Ros2 to ignition with `ros run ros_ign_bridge parameter_bridge /joint_states@sensor_msgs/msg/[email protected]` it works. However if you run JointStatePublisher or JointStatePublisherGui with `ros run...

bug
help wanted
ROS 2