Skip to content

Commit

Permalink
add lidar altimeter sensor support and enlarge base plates
Browse files Browse the repository at this point in the history
  • Loading branch information
Myzhe committed Oct 1, 2024
1 parent 536305a commit 2ff6f37
Show file tree
Hide file tree
Showing 8 changed files with 72 additions and 12 deletions.
30 changes: 30 additions & 0 deletions models/advanced_plane/model.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -125,6 +125,36 @@
<always_on>1</always_on>
<update_rate>30</update_rate>
</sensor>
<sensor name="distance_sensor" type="gpu_lidar">
<pose>0 0 -0.1 0 1.57 0</pose>
<always_on>1</always_on>
<update_rate>25</update_rate>
<lidar>
<scan>
<horizontal>
<samples>1</samples>
<resolution>1</resolution>
<min_angle>0</min_angle>
<max_angle>0</max_angle>
</horizontal>
<vertical>
<samples>1</samples>
<resolution>1</resolution>
<min_angle>0</min_angle>
<max_angle>0</max_angle>
</vertical>
</scan>
<range>
<min>0.05</min>
<max>40.0</max>
<resolution>0.05</resolution>
</range>
<noise>
<mean>0</mean>
<stddev>0.025</stddev>
</noise>
</lidar>
</sensor>
</link>
<link name='rotor_puller'>
<pose>0.3 0 0.0 0 1.57 0</pose>
Expand Down
30 changes: 30 additions & 0 deletions models/rc_cessna/model.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -154,6 +154,36 @@
</pressure>
</air_pressure>
</sensor>
<sensor name="distance_sensor" type="gpu_lidar">
<pose>0 0 -0.1 0 1.57 0</pose>
<always_on>1</always_on>
<update_rate>25</update_rate>
<lidar>
<scan>
<horizontal>
<samples>1</samples>
<resolution>1</resolution>
<min_angle>0</min_angle>
<max_angle>0</max_angle>
</horizontal>
<vertical>
<samples>1</samples>
<resolution>1</resolution>
<min_angle>0</min_angle>
<max_angle>0</max_angle>
</vertical>
</scan>
<range>
<min>0.05</min>
<max>40.0</max>
<resolution>0.05</resolution>
</range>
<noise>
<mean>0</mean>
<stddev>0.025</stddev>
</noise>
</lidar>
</sensor>
</link>
<link name="airspeed">
<pose>0 0 0 0 0 0</pose>
Expand Down
4 changes: 2 additions & 2 deletions worlds/aruco.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -170,7 +170,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand All @@ -185,7 +185,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>100 100</size>
<size>400 400</size>
</plane>
</geometry>
<material>
Expand Down
4 changes: 2 additions & 2 deletions worlds/default.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -170,7 +170,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand All @@ -185,7 +185,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>100 100</size>
<size>400 400</size>
</plane>
</geometry>
<material>
Expand Down
2 changes: 1 addition & 1 deletion worlds/lawn.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -175,7 +175,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand Down
2 changes: 1 addition & 1 deletion worlds/rover.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -170,7 +170,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand Down
4 changes: 2 additions & 2 deletions worlds/walls.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -182,7 +182,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand All @@ -197,7 +197,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>100 100</size>
<size>400 400</size>
</plane>
</geometry>
<material>
Expand Down
8 changes: 4 additions & 4 deletions worlds/windy.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -17,7 +17,7 @@
<render_engine>ogre2</render_engine>
</plugin>
<gui fullscreen='false'>

<!-- 3D scene -->
<plugin filename="MinimalScene" name="3D View">
<gz-gui>
Expand Down Expand Up @@ -117,7 +117,7 @@
<property key="showTitleBar" type="bool">false</property>
</gz-gui>
</plugin>

<plugin name='World control' filename='WorldControl'>
<gz-gui>
<title>World control</title>
Expand Down Expand Up @@ -173,7 +173,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>1 1</size>
<size>400 400</size>
</plane>
</geometry>
<surface>
Expand All @@ -188,7 +188,7 @@
<geometry>
<plane>
<normal>0 0 1</normal>
<size>100 100</size>
<size>400 400</size>
</plane>
</geometry>
<material>
Expand Down

0 comments on commit 2ff6f37

Please sign in to comment.