Ros_gz_bridge does not publish on ros2 topic

I am running ros_gz_bridge to read some data from Gazebo, in particular I have run:

ros2 run ros_gz_bridge parameter_bridge /model/x500_vision_0/odometry@nav_msgs/msg/Odometry[gz.msgs.Odometry

[INFO] [1706113773.667589591] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/model/x500_vision_0/odometry (gz.msgs.Odometry) -> /model/x500_vision_0/odometry (nav_msgs/msg/Odometry)] (Lazy 0)

The problem is that when I run

ros2 topic echo /model/x500_vision_0/odometry

I do not see any message published on the topic.

I have already checked that the name of the topic is correct, and when I run

gz topic -et /model/x500_vision_0/odometry

I can see the messages exchanged within Gazebo.

So why is the bridge not publishing the messages on the ROS2 network?

I solved the issue.
I was working with Gazebo Garden and ROS2 Humble, but I had installed the Gazebo Fortress version of the bridge.

hi what changes did you make for it?

Hi,
unfortunately it has been a while since I was actively working with ROS2 and Gazebo. If I remember correctly the ros_gz_bridge package that was available via apt (i.e. ros-humble-ros-gz-bridge) was the one related to gazebo fortress. To solve the issue I uninstalled the apt package and I compiled the package from source.

I think you can find more information here: GitHub - gazebosim/ros_gz: Integration between ROS (1 and 2) and Gazebo simulation and https://gaz.ebosim.org/docs/latest/ros_installation/#gazebo-garden-with-ros-2-humble-iron-or-rolling-use-with-caution-

Have a great day.

Biagio