Skip to content

Commit

Permalink
Fix xmlns and update comments
Browse files Browse the repository at this point in the history
Signed-off-by: Steve Peters <scpeters@openrobotics.org>
  • Loading branch information
scpeters committed Mar 24, 2021
1 parent 49eb8cb commit 15416d0
Showing 1 changed file with 4 additions and 6 deletions.
10 changes: 4 additions & 6 deletions examples/worlds/mecanum_drive.sdf
Original file line number Diff line number Diff line change
@@ -1,14 +1,12 @@
<?xml version="1.0" ?>
<!--
Ignition Gazebo skid steer differential drive plugin demo
Ignition Gazebo Mecanum drive plugin demo
Try sending commands:
ign topic -t "/model/vehicle_blue/cmd_vel" -m ignition.msgs.Twist -p "linear: {x: 0.5}, angular: {z: 0.05}"
ign topic -t "/model/vehicle_blue/cmd_vel" -m ignition.msgs.Twist -p "linear: {x: 0.5, y: 0.5}"
Listen to odometry:
ign topic -e -t /model/vehicle_blue/odometry
ign topic -t "/model/vehicle_blue/cmd_vel" -m ignition.msgs.Twist -p "linear: {y: 0.5}, angular: {z: 0.2}"
-->
<sdf version="1.6">
Expand Down Expand Up @@ -79,7 +77,7 @@
</link>
</model>

<model name='vehicle_blue' xmlns:gazebo="http://gazebosim.org/schema">
<model name='vehicle_blue' xmlns:ignition="http://ignitionrobotics.org/schema">
<pose>0 2 0.325 0 -0 0</pose>

<link name='chassis'>
Expand Down

0 comments on commit 15416d0

Please sign in to comment.