├── .github ├── CONTRIBUTING.md ├── ISSUE_TEMPLATE │ ├── bug_report.md │ ├── config.yml │ └── feature_request.md ├── SUPPORT.md └── workflows │ ├── ccache.env │ ├── ccpcheck.yml │ ├── ccplint.yml │ └── ubuntu-build.yml ├── .gitignore ├── CMakeLists.txt ├── CPPLINT.cfg ├── LICENSE.md ├── README.md ├── cmake └── cmake_uninstall.cmake.in ├── config └── gazebo-iris-gimbal.parm ├── hooks ├── ardupilot_gazebo.dsv.in └── ardupilot_gazebo.sh.in ├── include ├── ArduPilotPlugin.hh ├── CameraZoomPlugin.hh ├── GstCameraPlugin.hh ├── ParachutePlugin.hh ├── SelectionBuffer.hh ├── SocketUDP.hh └── Util.hh ├── models ├── gimbal_small_1d │ ├── meshes │ │ ├── base_arm.dae │ │ ├── base_main.dae │ │ └── tilt.dae │ ├── model.config │ └── model.sdf ├── gimbal_small_2d │ ├── meshes │ │ ├── base_arm.dae │ │ ├── base_main.dae │ │ └── tilt.dae │ ├── model.config │ └── model.sdf ├── gimbal_small_3d │ ├── meshes │ │ ├── base_plate.dae │ │ ├── camera_enclosure.dae │ │ ├── roll_arm.dae │ │ └── yaw_arm.dae │ ├── model.config │ └── model.sdf ├── iris_with_ardupilot │ ├── model.config │ └── model.sdf ├── iris_with_gimbal │ ├── model.config │ └── model.sdf ├── iris_with_standoffs │ ├── meshes │ │ ├── iris.dae │ │ ├── iris_prop_ccw.dae │ │ └── iris_prop_cw.dae │ ├── model.config │ └── model.sdf ├── parachute_small │ ├── meshes │ │ └── parachute_small.dae │ ├── model.config │ └── model.sdf ├── runway │ ├── materials │ │ └── textures │ │ │ ├── Grass004_2K_AmbientOcclusion.jpg │ │ │ ├── Grass004_2K_Color copy.jpg │ │ │ ├── Grass004_2K_Color.jpg │ │ │ ├── Grass004_2K_Displacement.jpg │ │ │ ├── Grass004_2K_NormalGL.jpg │ │ │ ├── Grass004_2K_Roughness.jpg │ │ │ └── runway.png │ ├── meshes │ │ └── airfield.dae │ ├── model.config │ └── model.sdf ├── zephyr │ ├── materials │ │ └── textures │ │ │ └── wing.png │ ├── meshes │ │ ├── parachute_small.dae │ │ └── wing.dae │ ├── model.config │ ├── model.sdf │ └── thumbnails │ │ ├── 1.png │ │ ├── 2.png │ │ ├── 3.png │ │ ├── 4.png │ │ └── 5.png ├── zephyr_with_ardupilot │ ├── model.config │ └── model.sdf └── zephyr_with_parachute │ ├── model.config │ └── model.sdf ├── package.xml ├── src ├── ArduPilotPlugin.cc ├── CameraZoomPlugin.cc ├── GstCameraPlugin.cc ├── ParachutePlugin.cc ├── SocketUDP.cc └── Util.cc ├── tests └── worlds │ ├── test_anemometer.sdf │ ├── test_gimbal.sdf │ ├── test_nested_model.sdf │ └── test_parachute.sdf └── worlds ├── gimbal.sdf ├── iris_runway.sdf ├── iris_warehouse.sdf ├── zephyr_parachute.sdf └── zephyr_runway.sdf /.github/CONTRIBUTING.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/CONTRIBUTING.md -------------------------------------------------------------------------------- /.github/ISSUE_TEMPLATE/bug_report.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/ISSUE_TEMPLATE/bug_report.md -------------------------------------------------------------------------------- /.github/ISSUE_TEMPLATE/config.yml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/ISSUE_TEMPLATE/config.yml -------------------------------------------------------------------------------- /.github/ISSUE_TEMPLATE/feature_request.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/ISSUE_TEMPLATE/feature_request.md -------------------------------------------------------------------------------- /.github/SUPPORT.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/SUPPORT.md -------------------------------------------------------------------------------- /.github/workflows/ccache.env: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/workflows/ccache.env -------------------------------------------------------------------------------- /.github/workflows/ccpcheck.yml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/workflows/ccpcheck.yml -------------------------------------------------------------------------------- /.github/workflows/ccplint.yml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/workflows/ccplint.yml -------------------------------------------------------------------------------- /.github/workflows/ubuntu-build.yml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.github/workflows/ubuntu-build.yml -------------------------------------------------------------------------------- /.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/.gitignore -------------------------------------------------------------------------------- /CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/CMakeLists.txt -------------------------------------------------------------------------------- /CPPLINT.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/CPPLINT.cfg -------------------------------------------------------------------------------- /LICENSE.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/LICENSE.md -------------------------------------------------------------------------------- /README.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/README.md -------------------------------------------------------------------------------- /cmake/cmake_uninstall.cmake.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/cmake/cmake_uninstall.cmake.in -------------------------------------------------------------------------------- /config/gazebo-iris-gimbal.parm: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/config/gazebo-iris-gimbal.parm -------------------------------------------------------------------------------- /hooks/ardupilot_gazebo.dsv.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/hooks/ardupilot_gazebo.dsv.in -------------------------------------------------------------------------------- /hooks/ardupilot_gazebo.sh.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/hooks/ardupilot_gazebo.sh.in -------------------------------------------------------------------------------- /include/ArduPilotPlugin.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/ArduPilotPlugin.hh -------------------------------------------------------------------------------- /include/CameraZoomPlugin.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/CameraZoomPlugin.hh -------------------------------------------------------------------------------- /include/GstCameraPlugin.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/GstCameraPlugin.hh -------------------------------------------------------------------------------- /include/ParachutePlugin.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/ParachutePlugin.hh -------------------------------------------------------------------------------- /include/SelectionBuffer.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/SelectionBuffer.hh -------------------------------------------------------------------------------- /include/SocketUDP.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/SocketUDP.hh -------------------------------------------------------------------------------- /include/Util.hh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/include/Util.hh -------------------------------------------------------------------------------- /models/gimbal_small_1d/meshes/base_arm.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_1d/meshes/base_arm.dae -------------------------------------------------------------------------------- /models/gimbal_small_1d/meshes/base_main.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_1d/meshes/base_main.dae -------------------------------------------------------------------------------- /models/gimbal_small_1d/meshes/tilt.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_1d/meshes/tilt.dae -------------------------------------------------------------------------------- /models/gimbal_small_1d/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_1d/model.config -------------------------------------------------------------------------------- /models/gimbal_small_1d/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_1d/model.sdf -------------------------------------------------------------------------------- /models/gimbal_small_2d/meshes/base_arm.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_2d/meshes/base_arm.dae -------------------------------------------------------------------------------- /models/gimbal_small_2d/meshes/base_main.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_2d/meshes/base_main.dae -------------------------------------------------------------------------------- /models/gimbal_small_2d/meshes/tilt.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_2d/meshes/tilt.dae -------------------------------------------------------------------------------- /models/gimbal_small_2d/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_2d/model.config -------------------------------------------------------------------------------- /models/gimbal_small_2d/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_2d/model.sdf -------------------------------------------------------------------------------- /models/gimbal_small_3d/meshes/base_plate.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/meshes/base_plate.dae -------------------------------------------------------------------------------- /models/gimbal_small_3d/meshes/camera_enclosure.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/meshes/camera_enclosure.dae -------------------------------------------------------------------------------- /models/gimbal_small_3d/meshes/roll_arm.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/meshes/roll_arm.dae -------------------------------------------------------------------------------- /models/gimbal_small_3d/meshes/yaw_arm.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/meshes/yaw_arm.dae -------------------------------------------------------------------------------- /models/gimbal_small_3d/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/model.config -------------------------------------------------------------------------------- /models/gimbal_small_3d/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/gimbal_small_3d/model.sdf -------------------------------------------------------------------------------- /models/iris_with_ardupilot/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_ardupilot/model.config -------------------------------------------------------------------------------- /models/iris_with_ardupilot/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_ardupilot/model.sdf -------------------------------------------------------------------------------- /models/iris_with_gimbal/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_gimbal/model.config -------------------------------------------------------------------------------- /models/iris_with_gimbal/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_gimbal/model.sdf -------------------------------------------------------------------------------- /models/iris_with_standoffs/meshes/iris.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_standoffs/meshes/iris.dae -------------------------------------------------------------------------------- /models/iris_with_standoffs/meshes/iris_prop_ccw.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_standoffs/meshes/iris_prop_ccw.dae -------------------------------------------------------------------------------- /models/iris_with_standoffs/meshes/iris_prop_cw.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_standoffs/meshes/iris_prop_cw.dae -------------------------------------------------------------------------------- /models/iris_with_standoffs/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_standoffs/model.config -------------------------------------------------------------------------------- /models/iris_with_standoffs/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/iris_with_standoffs/model.sdf -------------------------------------------------------------------------------- /models/parachute_small/meshes/parachute_small.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/parachute_small/meshes/parachute_small.dae -------------------------------------------------------------------------------- /models/parachute_small/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/parachute_small/model.config -------------------------------------------------------------------------------- /models/parachute_small/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/parachute_small/model.sdf -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_AmbientOcclusion.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_AmbientOcclusion.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_Color copy.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_Color copy.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_Color.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_Color.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_Displacement.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_Displacement.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_NormalGL.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_NormalGL.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/Grass004_2K_Roughness.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/Grass004_2K_Roughness.jpg -------------------------------------------------------------------------------- /models/runway/materials/textures/runway.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/materials/textures/runway.png -------------------------------------------------------------------------------- /models/runway/meshes/airfield.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/meshes/airfield.dae -------------------------------------------------------------------------------- /models/runway/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/model.config -------------------------------------------------------------------------------- /models/runway/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/runway/model.sdf -------------------------------------------------------------------------------- /models/zephyr/materials/textures/wing.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/materials/textures/wing.png -------------------------------------------------------------------------------- /models/zephyr/meshes/parachute_small.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/meshes/parachute_small.dae -------------------------------------------------------------------------------- /models/zephyr/meshes/wing.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/meshes/wing.dae -------------------------------------------------------------------------------- /models/zephyr/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/model.config -------------------------------------------------------------------------------- /models/zephyr/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/model.sdf -------------------------------------------------------------------------------- /models/zephyr/thumbnails/1.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/thumbnails/1.png -------------------------------------------------------------------------------- /models/zephyr/thumbnails/2.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/thumbnails/2.png -------------------------------------------------------------------------------- /models/zephyr/thumbnails/3.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/thumbnails/3.png -------------------------------------------------------------------------------- /models/zephyr/thumbnails/4.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/thumbnails/4.png -------------------------------------------------------------------------------- /models/zephyr/thumbnails/5.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr/thumbnails/5.png -------------------------------------------------------------------------------- /models/zephyr_with_ardupilot/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr_with_ardupilot/model.config -------------------------------------------------------------------------------- /models/zephyr_with_ardupilot/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr_with_ardupilot/model.sdf -------------------------------------------------------------------------------- /models/zephyr_with_parachute/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr_with_parachute/model.config -------------------------------------------------------------------------------- /models/zephyr_with_parachute/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/models/zephyr_with_parachute/model.sdf -------------------------------------------------------------------------------- /package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/package.xml -------------------------------------------------------------------------------- /src/ArduPilotPlugin.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/ArduPilotPlugin.cc -------------------------------------------------------------------------------- /src/CameraZoomPlugin.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/CameraZoomPlugin.cc -------------------------------------------------------------------------------- /src/GstCameraPlugin.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/GstCameraPlugin.cc -------------------------------------------------------------------------------- /src/ParachutePlugin.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/ParachutePlugin.cc -------------------------------------------------------------------------------- /src/SocketUDP.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/SocketUDP.cc -------------------------------------------------------------------------------- /src/Util.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/src/Util.cc -------------------------------------------------------------------------------- /tests/worlds/test_anemometer.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/tests/worlds/test_anemometer.sdf -------------------------------------------------------------------------------- /tests/worlds/test_gimbal.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/tests/worlds/test_gimbal.sdf -------------------------------------------------------------------------------- /tests/worlds/test_nested_model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/tests/worlds/test_nested_model.sdf -------------------------------------------------------------------------------- /tests/worlds/test_parachute.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/tests/worlds/test_parachute.sdf -------------------------------------------------------------------------------- /worlds/gimbal.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/worlds/gimbal.sdf -------------------------------------------------------------------------------- /worlds/iris_runway.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/worlds/iris_runway.sdf -------------------------------------------------------------------------------- /worlds/iris_warehouse.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/worlds/iris_warehouse.sdf -------------------------------------------------------------------------------- /worlds/zephyr_parachute.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/worlds/zephyr_parachute.sdf -------------------------------------------------------------------------------- /worlds/zephyr_runway.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ArduPilot/ardupilot_gazebo/HEAD/worlds/zephyr_runway.sdf --------------------------------------------------------------------------------