ros-visualization / rqt_graph

http://wiki.ros.org/rqt_graph
26 stars 27 forks source link

Toggling Hide `Debug` causes ros2cli node name to get prefixed with `n__` #65

Open sloretz opened 3 years ago

sloretz commented 3 years ago

Following this tutorial: https://docs.ros.org/en/rolling/Tutorials/Launch-Files/Creating-Launch-Files.html

I notice that toggling Debug causes the ros2cli node name to get prefixed with n__.

Launch file

from launch import LaunchDescription
from launch_ros.actions import Node

def generate_launch_description():
    return LaunchDescription([
        Node(
            package='turtlesim',
            namespace='turtlesim1',
            executable='turtlesim_node',
            name='sim'
        ),
        Node(
            package='turtlesim',
            namespace='turtlesim2',
            executable='turtlesim_node',
            name='sim'
        ),
        Node(
            package='turtlesim',
            executable='mimic',
            name='mimic',
            remappings=[
                ('/input/pose', '/turtlesim1/turtle1/pose'),
                ('/output/cmd_vel', '/turtlesim2/turtle1/cmd_vel'),
            ]
        )
    ])

Publish command

ros2 topic pub -r 1 /turtlesim1/turtle1/cmd_vel geometry_msgs/msg/Twist "{linear: {x: 2.0, y: 0.0, z: 0.0}, angular: {x: 0.0, y: 0.0, z: -1.8}}"

To reproduce, launch the launch file, start the publish command, run rqt_console, and observe what happens when Debug is toggled.

With Debug not hidden the node is /_ros2cli_52974 image

With Debug hidden the node is n__ros2cli_52974 image

I'm not sure if I would expect the node name to stay the same, or if I would expect the ros2cli node to be hidden when Debug is checked.