Skip to content

ethz-asl/terrain-navigation2

Repository files navigation

terrain-navigation

Build Test

This package includes an implementation of the RA-L submission of "Safe Low-Altitude Navigation in Steep Terrain with Fixed-Wing Aerial Vehicles". The implementation includes a global planner based on a RRT* in the Dubins Airplane space enabling low altitude navigation for fixed wing vehicles in steep terrain.

overview

Setup

Setting up the Build Environment using Docker

If your operating system doesn't support ROS 2 humble, docker is a great alternative.

First, create the image, with the build context at the root of this repo

docker build --file docker/Dockerfile --tag terrain-navigation-ros2 .

You can see the image exists:

docker images
>>> REPOSITORY                TAG       IMAGE ID       CREATED        SIZE
>>> terrain-navigation-ros2   latest    5565f845ab4f   2 weeks ago    774MB

Next, run the image, mounting in the source into a workspace. All the dependencies are now installed.

docker run --network=host -it -v $(pwd):/root/ros2_ws/src/ethz-asl/terrain-navigation -w /root/ros2_ws terrain-navigation-ros2 bash

Running the Build

For dependencies that do not have binaries available, pull them into your ROS workspace using vcs.

cd ~/ros2_ws/src
wget https://raw.githubusercontent.com/ethz-asl/terrain-navigation/ros2/terrain-navigation.repos
vcs import --recursive < terrain-navigation.repos

For dependencies available through binaries, use rosdep. This package depends on GDAL to read georeferenced images and GeoTIFF files.

sudo apt update
rosdep update
source /opt/ros/humble/setup.bash
rosdep install --from-paths src --ignore-src

Build the package

colcon build --packages-up-to terrain_navigation_ros

Running with PX4 SITL(Software-In-The-Loop), Gazebo and QGroundControl (QGC)

Pre-requisites:

  • Ubuntu 22.04 with ROS 2 Humble
  • Gazebo harmonic

PX4 SITL Session with Gazebo

To setup PX4, clone the a custom version of PX4. The setup instructions can be found in the documentation for the latest dependencies.

This branch contains a small fix to the height rate setpoint forward ported to main, and a DEM for Gazebo of the region used in the terrain planner.

First set up the PX4 development environment:

git clone https://github.com/srmainwaring/PX4-AutoPilot --branch prs/pr-hinwil-testing-rebased --recursive
cd PX4-AutoPilot
./Tools/setup/ubuntu.sh

Now, configure the shell environment to run gz_standard_vtol.

# Source environment variables mentioned in PX4-Autopilot/Tools/simulation/gz/worlds/davosdorf.sdf
export PX4_HOME_LAT=46.8132056
export PX4_HOME_LON=9.8479538
export PX4_HOME_ALT=1562.0
export PX4_GZ_VERBOSE=4
export PX4_GZ_MODEL_POSE="0,0,1562,0,0,0"
export PX4_GZ_WORLD=davosdorf
# TODO remove these variables and make it use a proper aligned world.

make px4_sitl gz_standard_vtol

Due to the camera spawn location bug in PX4-Autpilot#22659, in the Gazebo Entity Tree view, click "standard_vtol_0" -> "Follow" to center the camera on the vehicle. The QuadPlane will be visible sitting on terrain in Davos, Switzerland.

QGC

QGroundControl (QGC) will be used for loading a mission and sending a takeoff command. QGC can also monitor the vehicle's flight mode and status through MAVLink.

Install QGroundControl to configure and fly the vehicle. The instructions below may be specific to version 4.3.0.

Let's get the vehicle flying, and plan a mission to fly!

  1. Disconnect any flight controllers; these would interfere with SITL.
  2. Start QGC.
  3. Enable virtual joystick.
    Without this, the QGC status bar will be yellow and report an arming check report of "No manual control input".
  4. Upload a mission. Go to the "Plan" screen, click "File" -> Storage "Open..." and select the davosdorf mission:
  5. Then, click the light blue flashing "Upload Required" button to upload the mission to the vehicle.
  6. Go back to the "Fly" screen.
  7. Use the slider to start the mission. The vehicle will launch vertically, transition to fixed wing mode, and enter a loiter next to Lake Davos.

Once the vehicle is flying in a loiter, plan a mission, engage the planner and fly through the rviz UI (Video: https://youtu.be/EJWyGSqaKb4)

ROS 2 Terrain Planner, MavROS and RVIZ

Launch the terrain planner, mavros, and rviz nodes in separate terminals.

These can be combined but it helps with debugging to run them separately:

Terminal 1 - Terrain Planner:

ros2 launch terrain_navigation_ros terrain_planner.launch.py rviz:=false

Terminal 2 - MAVRos:

ros2 launch terrain_navigation_ros mavros.launch.py flight_stack:=px4

If you get warnings from mavros like this, ignore them:

[mavros_node-1] [WARN] [1705686179.019743422] [mavros.guided_target]: PositionTargetGlobal failed because no origin

TODO: Fix QOS incompatibility on the following topic:

ros2 topic info /mavros/global_position/gp_origin -v

Terminal 3 - RVIZ:

ros2 launch terrain_navigation_ros rviz.launch.py

Set the start and goal positions. If the interactive marker server is not updating correctly this may done using service calls:

Terminal 4 - Services

ros2 service call /terrain_planner/set_start planner_msgs/srv/SetVector3 "{vector: {x: 1570, y: -330, z: -1}}"
ros2 service call /terrain_planner/set_goal planner_msgs/srv/SetVector3 "{vector: {x: -100, y: -200, z: -1}}"

Trigger the planner and set the planner to navigate. The equivalent ROS 2 service calls are:

Terminal 4 - Services

ros2 service call /terrain_planner/trigger_planning planner_msgs/srv/SetVector3 "{vector: {z: 10.0}}"
ros2 service call /terrain_planner/set_planner_state planner_msgs/srv/SetPlannerState "{state: 2}"

Figure: rviz after planning px4_terrain_rviz_plan

Finally engage the planner by switching the plane to OFFBOARD mode. Using mavros directly this is:

ros2 service call /mavros/set_mode mavros_msgs/srv/SetMode "{custom_mode: OFFBOARD}" Figure: Gazebo and QGC at the goal px4_terrain_gz_goal px4_terrain_qgc_goal

About

No description, website, or topics provided.

Resources

License

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published