Skip to content

Commit

Permalink
Merge branch 'main' into adlarkin/use_step_output_data
Browse files Browse the repository at this point in the history
Signed-off-by: Ashton Larkin <ashton@openrobotics.org>
  • Loading branch information
adlarkin committed Mar 24, 2021
2 parents 040b4a1 + 5d3970a commit dca0f66
Show file tree
Hide file tree
Showing 20 changed files with 2,014 additions and 328 deletions.
2 changes: 1 addition & 1 deletion CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -119,7 +119,7 @@ set(IGN_RENDERING_VER ${ignition-rendering5_VERSION_MAJOR})

#--------------------------------------
# Find ignition-math
ign_find_package(ignition-math6 REQUIRED COMPONENTS eigen3 VERSION 6.6)
ign_find_package(ignition-math6 REQUIRED COMPONENTS eigen3 VERSION 6.8)
set(IGN_MATH_VER ${ignition-math6_VERSION_MAJOR})

#--------------------------------------
Expand Down
12 changes: 6 additions & 6 deletions examples/worlds/ackermann_steering.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -315,12 +315,12 @@
</cylinder>
</geometry>
<material>
<ambient>11 11 11</ambient>
<diffuse>11 11 11</diffuse>
<ambient>1 1 1</ambient>
<diffuse>1 1 1</diffuse>
</material>
</visual>
</link>

<link name="front_right_wheel_steering_link">
<pose>0.554283 -0.5 0.02 0 0 0</pose>
<inertial>
Expand All @@ -340,8 +340,8 @@
</cylinder>
</geometry>
<material>
<ambient>11 11 11</ambient>
<diffuse>11 11 11</diffuse>
<ambient>1 1 1</ambient>
<diffuse>1 1 1</diffuse>
</material>
</visual>
</link>
Expand All @@ -360,7 +360,7 @@
<use_parent_model_frame>1</use_parent_model_frame>
</axis>
</joint>

<joint name="front_right_wheel_steering_joint" type="revolute">
<parent>chassis</parent>
<child>front_right_wheel_steering_link</child>
Expand Down
Loading

0 comments on commit dca0f66

Please sign in to comment.