File tree Expand file tree Collapse file tree 1 file changed +3
-6
lines changed Expand file tree Collapse file tree 1 file changed +3
-6
lines changed Original file line number Diff line number Diff line change @@ -96,9 +96,8 @@ Then we start the parameter bridge which will watch the specified topics.
96
96
97
97
```
98
98
# Shell B:
99
- . /opt/ros/melodic/setup.bash
100
99
. ~/bridge_ws/install/setup.bash
101
- parameter_bridge /chatter@std_msgs/String@ignition.msgs.StringMsg
100
+ rosrun ros1_ign_bridge parameter_bridge /chatter@std_msgs/String@ignition.msgs.StringMsg
102
101
```
103
102
104
103
Now we start the ROS 1 listener.
@@ -130,9 +129,8 @@ Then we start the parameter bridge which will watch the specified topics.
130
129
131
130
```
132
131
# Shell B:
133
- . /opt/ros/melodic/setup.bash
134
132
. ~/bridge_ws/install/setup.bash
135
- parameter_bridge /chatter@std_msgs/String@ignition.msgs.StringMsg
133
+ rosrun ros1_ign_bridge parameter_bridge /chatter@std_msgs/String@ignition.msgs.StringMsg
136
134
```
137
135
138
136
Now we start the Ignition Transport listener.
@@ -184,9 +182,8 @@ Then we start the parameter bridge with the previous topic.
184
182
185
183
```
186
184
# Shell D:
187
- . /opt/ros/melodic/setup.bash
188
185
. ~/bridge_ws/install/setup.bash
189
- parameter_bridge /default/camera/link/camera/image@sensor_msgs/Image@ignition.msgs.Image
186
+ rosrun ros1_ign_bridge parameter_bridge /default/camera/link/camera/image@sensor_msgs/Image@ignition.msgs.Image
190
187
```
191
188
192
189
Now we start the ROS 1 GUI:
You can’t perform that action at this time.
0 commit comments