Skip to content

Commit

Permalink
cleanup
Browse files Browse the repository at this point in the history
  • Loading branch information
Tony Najjar committed Jul 23, 2022
1 parent 9f7857e commit faf9ab9
Show file tree
Hide file tree
Showing 3 changed files with 3 additions and 6 deletions.
2 changes: 1 addition & 1 deletion gazebo_ros2_control_demos/launch/diff_drive.launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -53,7 +53,7 @@ def generate_launch_description():

spawn_entity = Node(package='gazebo_ros', executable='spawn_entity.py',
arguments=['-topic', 'robot_description',
'-entity', 'cartpole'],
'-entity', 'diffbot'],
output='screen')

load_joint_state_controller = Node(
Expand Down
2 changes: 1 addition & 1 deletion gazebo_ros2_control_demos/launch/tricycle_drive.launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -53,7 +53,7 @@ def generate_launch_description():

spawn_entity = Node(package='gazebo_ros', executable='spawn_entity.py',
arguments=['-topic', 'robot_description',
'-entity', 'cartpole'],
'-entity', 'tricycle'],
output='screen')

load_joint_state_controller = Node(
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -158,10 +158,7 @@
<plugin>gazebo_ros2_control/GazeboSystem</plugin>
</hardware>
<joint name="steering_joint">
<command_interface name="position">
<param name="min">${-pi/2}</param>
<param name="max">${pi/2}</param>
</command_interface>
<command_interface name="position" />
<state_interface name="position" />
</joint>
<joint name="traction_joint">
Expand Down

0 comments on commit faf9ab9

Please sign in to comment.