gazebosim / ros_gz

Integration between ROS (1 and 2) and Gazebo simulation
https://gazebosim.org
Apache License 2.0
211 stars 125 forks source link

`expand_gz_topic_names` parameter does not work #529

Closed elkuno213 closed 1 month ago

elkuno213 commented 2 months ago

Environment

Description

Steps to reproduce

  1. Follow the Example 6.
  2. Run this command:
ros2 run ros_gz_bridge parameter_bridge chatter@std_msgs/msg/String@ignition.msgs.StringMsg \
  --ros-args -p expand_gz_topic_names:=true -r __ns:=/demo
  1. In other terminal, run this command:

    ign topic --list 
    # Output: /chatter

    The topic is still /chatter, not /demo/chatter as expected.

  2. Run other command to check whether the parameter is existing:

    ros2 param list | grep expand_gz_topic_names
    # Output: nothing found
  3. This code snippet shows that expand_gz_topic_names only works when config_file is given.

Output

image image

azeey commented 2 months ago

expand_gz_topic_names was added recently in https://github.com/gazebosim/ros_gz/pull/512 and ported to iron in https://github.com/gazebosim/ros_gz/pull/516. It has not been released yet (see https://github.com/gazebosim/ros_gz/blob/iron/ros_gz_bridge/CHANGELOG.rst). @ahcorde can you make a 0.254.1 release?

ahcorde commented 2 months ago

I made releases for Humble and Iron