gz_ros2_control icon indicating copy to clipboard operation
gz_ros2_control copied to clipboard

Connect the latest version of Gazebo with ros2_control.

Results 53 gz_ros2_control issues
Sort by recently updated
recently updated
newest added

`gui:=false` does not work anymore, and the docs for docker usage seems to be outdated https://github.com/ros-controls/gz_ros2_control/blob/18fd2c7faf089bfcd6958c67c948de62c8884803/doc/index.rst?plain=1#L34 @ahcorde Is there any other possibility instead of using the `-s` gz_args, i.e., to...

> For demonstration purposes, I change the initial pose to be in the lower equilibrium to make this clearer: > https://github.com/ros-controls/gazebo_ros2_control/assets/3367244/630cc8b8-6cb4-4dbc-9caa-948c085052e0 _Originally posted by @christophfroehlich in https://github.com/ros-controls/gazebo_ros2_control/issues/172#issuecomment-2105185043_ and make position...

`std_msgs` was deprecated since Foxy https://github.com/ros2/examples/issues/356 this PR replaces `std_msgs` with `example_interfaces`

This changes are neccessary to adjust compatibility with cleanup done in ros-controls/ros2_control#1354. Besides that I have simplified how robot description is accessed and also passing of update_rate is not simplified...

Hi, I am facing issue with ros2 hardware controls plugin. (This is just my assumption after analyzing the error) ROS2 - Iron Gazebo - Harmonic I have already set environment...

I am currently using ROS Humble + Ign Fortress and trying to load `ign_ros2_control` plugin using Ign Fortress. I am defining my own robot param parameter node as shown below...

## Environment * OS Version: Ubuntu 20.04 * Foxy * Ign Citadel - Generally, mention all circumstances that might affect rendering capabilities: - [ *] desktop acceleration - [ *]...

bug

This PR provides force-torque sensor data to Gazebo's controller_manager in a similar way to how the IMU data is currently provided. I made this change in order to test the...

Hi guys, I created this PR to allow Humble to work with Gazebo Garden. I started to work with iron branch because it contains the porting from ignition to gazebo...

Not sure what is going on but It seems that on harmonic, the examples are not working. I've installed ros_gz_sim and gz_ros2_control from source from the iron branch as I'm...