• Stars
    star
    463
  • Rank 94,661 (Top 2 %)
  • Language Makefile
  • License
    BSD 3-Clause "New...
  • Created over 6 years ago
  • Updated over 3 years ago

Reviews

There are no reviews yet. Be the first to send feedback to the community and the maintainers!

Repository Details

MAV planning tools using voxblox as the map representation.

mav_voxblox_planning_logo

MAV planning tools using voxblox as the map representation.

NOTE: THIS PACKAGE IS UNDER ACTIVE DEVELOPMENT! Things are subject to change at any time.

Table of Contents

Contents and Future Work

Included

  • Global Planning
    • RRT*, RRT Connect, BIT*, PRM... (OMPL interface) voxblox_rrt_planner
    • Planning on skeleton sparse graphs voxblox_skeleton_planner
    • Skeleton sparse graphs (topology) generation from ESDF voxblox maps voxblox_skeleton
    • Randomized benchmark on a variety of real maps mav_planning_benchmark
  • Path Smoothing (between waypoints)
    • Velocity ramp mav_path_smoothing
    • Polynomial with adding additional vertices at collisions mav_path_smoothing
    • Local polynomial optimization (Loco), unconstraining waypoints and minimizing collisions mav_path_smoothing, loco_planner
  • Local Planning -- mav_local_planner
    • Interface to MAV controller, sending timed, dynamically feasible trajectories and replanning online mav_local_planner
    • Planning in a short horizon in unknown or partially unknown spaces, using trajectory optimization in ESDFs voxblox_loco_planner
    • Path smoothing between waypoints if all waypoints are in known free space mav_path_smoothing
  • RVIZ Planning Plugin -- mav_planning_rviz
    • Allows dragging around start and goal markers, sending planning requests to global planners mav_planning_rviz
    • Allows sending goal points either directly to controller or to the local planner mav_local_planner

To Come (by end of January 2019)

  • Local Planning
    • Improved goal selection
    • Support for global and local coordinate frames
  • RVIZ Planning Plugin
    • Support for entering multiple waypoints

Papers and References

If using these, please cite:

voxblox

Helen Oleynikova, Zachary Taylor, Marius Fehr, Roland Siegwart, and Juan Nieto, β€œVoxblox: Incremental 3D Euclidean Signed Distance Fields for On-Board MAV Planning”. In IEEE Int. Conf. on Intelligent Robots and Systems (IROS), October 2017.
[pdf | bibtex | video | arxiv ]

loco planning

Helen Oleynikova, Michael Burri, Zachary Taylor, Juan Nieto, Roland Siegwart, and Enric Galceran, β€œContinuous-Time Trajectory Optimization for Online UAV Replanning”. In IEEE Int. Conf. on Intelligent Robots and Systems (IROS), October 2016.
[pdf | bibtex | video]

loco planning with voxblox

Helen Oleynikova, Zachary Taylor, Roland Siegwart, and Juan Nieto, β€œSafe Local Exploration for Replanning in Cluttered Unknown Environments for Micro-Aerial Vehicles”. IEEE Robotics and Automation Letters, 2018.
[pdf | bibtex | video | arxiv ]

voxblox skeleton and skeleton planning

Helen Oleynikova, Zachary Taylor, Roland Siegwart, and Juan Nieto, β€œSparse 3D Topological Graphs for Micro-Aerial Vehicle Planning”. In IEEE Int. Conf. on Intelligent Robots and Systems (IROS), October 2018.
[pdf | bibtex | video | arxiv ]

Getting Started

Installation

This package is intended to be used with Ubuntu 16.04 and ROS kinetic or above. After installing ROS, install some extra dependencies, substituting kinetic for your ROS version as necessary:

sudo apt-get install ros-kinetic-cmake-modules python-wstool python-catkin-tools libyaml-cpp-dev protobuf-compiler autoconf

Then if not already done so, set up a new catkin workspace:

mkdir -p ~/catkin_ws/src
cd ~/catkin_ws
catkin init
catkin config --extend /opt/ros/kinetic
catkin config --cmake-args -DCMAKE_BUILD_TYPE=Release
catkin config --merge-devel

If using SSH keys for github (recommended):

cd ~/catkin_ws/src/
git clone [email protected]:ethz-asl/mav_voxblox_planning.git
wstool init . ./mav_voxblox_planning/install/install_ssh.rosinstall
wstool update

If not using SSH keys but using https instead:

cd ~/catkin_ws/src/
git clone https://github.com/ethz-asl/mav_voxblox_planning.git
wstool init . ./mav_voxblox_planning/install/install_https.rosinstall
wstool update

If you have already initalized wstool replace the above wstool init with wstool merge -t

Compile:

cd ~/catkin_ws/src/
catkin build mav_voxblox_planning

Download maps

We've prepared a number of maps for you to try out our planning on. The archive is 260 MB big and available here.

It contains 6 maps from 3 scenarios: machine hall (indoor), shed (mixed indoor and outdoor area), and rubble (outdoor), each with Intel Realsense D400-series scans and with grayscale stereo matching scans. Each map features 3 files: esdf, skeleton (esdf + skeleton diagram), and sparse graph, which contains just the sparse graph generated using skeletonization.

Dataset Realsense Stereo
Machine Hall machine_hall_rs machine_hall_stereo
Rubble rubble_rs rubble_stereo
Shed shed_rs shed_stereo

Try out RRT and Skeleton planning

Get the planning panel

Make sure all the packages have built successfully! Re-source your workspace (source ~/catkin_ws/devel/setup.bash) and start up rviz (rviz). In rviz, select Panels -> Add New Panel and select Planning Panel: image

Next, under Displays, add an InteractiveMarkers display with the topic /planning_markers/update: image

You should now see both a path panel and start and goal arrows. You can select Edit on either the start or the goal to drag it around as an interactive marker: image

You can also edit the numbers in the x, y, z, yaw fields manually; the markers and the numbers will update automatically to match.

Using RRT voxblox planner:

In ~/catkin_ws/src/mav_voxblox_planning/voxblox_rrt_planner/launch/rrt_saved_map.launch, open the file and replace the voxblox_path to the path of one of the esdf maps you downloaded above. Then run the file:

roslaunch voxblox_rrt_planner rrt_saved_map.launch

Note that the Fixed Frame in RVIZ should match the value for the frame_id parameter in the launch file, in this case map. Using the another value for the Fixed Frame will result in no mesh display.

In the planning panel, enter voxblox_rrt_planner as the planner name, and add a VoxbloxMesh display with the topic /voxblox_rrt_planner/mesh and a MarkerArray display with the topic /voxblox_rrt_planner/path. You can now press the "Planner Service" button to plan! In green is the RRT output path, and the other colors show different types of smoothing through these waypoints.

image

Using the Skeleton planner:

Very similar to above... Open ~/catkin_ws/src/mav_voxblox_planning/voxblox_skeleton_planner/launch/skeleton_saved_map.launch and update the paths to point to matching skeleton and sparse graph files from the maps above. Run it with:

roslaunch voxblox_skeleton_planner skeleton_saved_map.launch

In the planning panel, enter voxblox_skeleton_planner as the planner name, and add a VoxbloxMesh display with the topic /voxblox_skeleton_planner/mesh and a MarkerArray display with the topic /voxblox_skeleton_planner/path. Additionally you can add a MarkerArray with topic /voxblox_skeleton_planner/sparse_graph You can now press the "Planner Service" button to plan! Pink is the shortened path from the sparse graph, and teal is smoothed using loco through it.

image

Try out Local Planning

This demo is about using the mav_local_planner to do live replanning at 4 Hz in a simulation environment. The local planner uses loco to locally track a waypoint, or if given a list of waypoints, plan a smooth path through them.

loco_really_small

Install Rotors Simulator

Follow the installation instructions here to install Rotors Simulator, which is an MAV simulator built on top of gazebo. This will allow us to fully simulate a typical MAV, with a visual-inertial sensor mounted on it.

Install the planning pannel (if you haven't yet)

See instructions above: here.

Run the simulation

After rotors is up and running, in a new terminal, launch the firefly sim: roslaunch mav_local_planner firefly_sim.launch

A gazebo window will come up, showing something similar to this: gazebo_local_sim

You can then control the MAV using the planning panel. Enter firefly as the Namespace in the planning panel, then either type a position for the goal or edit the goal to drag it around. To send it to the local planner, press the Send Waypoint button.

The trajectory will be visualized as a visualization_msgs/MarkerArray with the topic /firefly/mav_local_planner/local_path and you can view the explored mesh as a voxblox_msgs/Mesh message with the topic /firefly/voxblox_node/mesh. The complete setup is shown below:

rviz_local_sim1

In case the MAV gets stuck, you can use Send to Controller, which will directly send the pose command to the controller -- with no collision avoidance or trajectory planning.

Try out global + local planning

Once you've explored some of the map in simulation, you can also use the global planner to plan longer paths through known space. First, start the simulation global RRT* planner (this is in addition to the firefly_sim.launch file above):

roslaunch voxblox_rrt_planner firefly_rrt.launch

Local planning only uses the goal point, but global planning requires a start point as well (as the global planner does not know the odometry of the MAV). For this, we can use the Set start to odom option in the planning panel. To do this, in the Odometry Topic field, enter ground_truth/odometry and check the Set start to odom check-box. Now the start location will automatically track the odometry of the Firefly as it moves.

Once the start and goal poses are set as you want, press Planner Service. In rviz, add a MarkerArray display with the topic /firefly/voxblox_rrt_planner/path to visualize what the planner has planned. Once you are happy with this path, press Publish Path to send it to the local planner, which should start tracking the path immediately.

rviz_global_local

Advanced

Skeletonize your own maps

TODO! Instructions coming soon. See the voxblox_skeleton/launch/skeletonize_map.launch file for reference, please make an issue if there are any questions or problems.

More Repositories

1

kalibr

The Kalibr visual-inertial calibration toolbox
C++
4,357
star
2

maplab

A Modular and Multi-Modal Mapping Framework
C++
2,610
star
3

voxblox

A library for flexible voxel-based mapping, mainly focusing on truncated and Euclidean signed distance fields.
C++
1,336
star
4

rotors_simulator

RotorS is a UAV gazebo simulator
C++
1,245
star
5

okvis

OKVIS: Open Keyframe-based Visual-Inertial SLAM.
C++
1,158
star
6

rovio

C++
1,126
star
7

segmap

A map representation based on 3D segments
C++
1,070
star
8

ethzasl_msf

MSF - Modular framework for multi sensor fusion based on an Extended Kalman Filter (EKF)
C++
985
star
9

lidar_align

A simple method for finding the extrinsic calibration between a 3D lidar and a 6-dof pose sensor
C++
836
star
10

hfnet

From Coarse to Fine: Robust Hierarchical Localization at Large Scale with HF-Net (https://arxiv.org/abs/1812.03506)
Python
739
star
11

mav_active_3d_planning

Modular framework for online informative path planning.
C++
564
star
12

mav_trajectory_generation

Polynomial trajectory generation and optimization, especially for rotary-wing MAVs.
C++
548
star
13

polygon_coverage_planning

Coverage planning in general polygons with holes.
C++
528
star
14

aerial_mapper

Real-time Dense Point Cloud, Digital Surface Map (DSM) and (Ortho-)Mosaic Generation for UAVs
C++
524
star
15

voxgraph

Voxblox-based Pose graph optimization
C++
513
star
16

robust_point_cloud_registration

Robust Point Cloud Registration Using Iterative Probabilistic Data Associations ("Robust ICP")
C++
513
star
17

hand_eye_calibration

Python tools to perform time-synchronization and hand-eye calibration.
Python
439
star
18

dynablox

Real-time detection of diverse dynamic objects in complex environments.
C++
436
star
19

voxblox-plusplus

A volumetric object-level semantic mapping framework.
C++
409
star
20

mav_control_rw

Control strategies for rotary wing Micro Aerial Vehicles using ROS
C
350
star
21

ethzasl_sensor_fusion

time delay single and multi sensor fusion framework based on an EKF
C++
327
star
22

nbvplanner

A real-time capable exploration and inspection path planner (next best view planning)
C++
295
star
23

panoptic_mapping

A flexible submap-based framework towards spatio-temporally consistent volumetric mapping and scene understanding.
C++
275
star
24

ethzasl_icp_mapping

3D mapping tools for robotic applications
C++
268
star
25

okvis_ros

OKVIS: Open Keyframe-based Visual-Inertial SLAM (ROS Version)
C++
256
star
26

versavis

An Open Versatile Multi-Camera Visual-Inertial Sensor Suite
C++
256
star
27

kitti_to_rosbag

Dataset tools for working with the KITTI dataset raw data ( http://www.cvlibs.net/datasets/kitti/raw_data.php ) and converting it to a ROS bag. Also allows a library for direct access to poses, velodyne scans, and images.
C++
248
star
28

laser_slam

This package provides an end-to-end system to laser-based graph SLAM using laser point clouds.
C++
248
star
29

geodetic_utils

Simple library for converting coordinates to/from several geodetic frames (lat/lon, ECEF, ENU, NED, etc.)
C++
247
star
30

COIN-LIO

πŸͺ™ COIN-LIO: Complementary Intensity-Augmented LiDAR Inertial Odometry (ICRA 2024)
C++
245
star
31

image_undistort

A compact package for undistorting images directly from kalibr calibration files. Can also perform dense stereo estimation
C++
245
star
32

ethzasl_ptam

Modified version of Parallel Tracking and Mapping (PTAM)
C++
235
star
33

wavemap

Fast, efficient and accurate multi-resolution, multi-sensor 3D occupancy mapping
C++
226
star
34

cblox

Voxblox-based submapping
C++
207
star
35

aslam_cv2

C++
196
star
36

glocal_exploration

Efficient local and global exploration on submap collections with changing past pose estimates.
C++
186
star
37

volumetric_mapping

A repository for 3D volumetric (occupancy) maps, providing a generic interface for disparity map and pointcloud insertion, and support for custom sensor error models.
C++
186
star
38

vgn

Real-time 6 DOF grasp detection in clutter.
Python
181
star
39

hierarchical_loc

Deep image retrieval for efficient 6-DoF localization
Python
172
star
40

orb_slam_2_ros

ROS interface for ORBSLAM2!!
C++
171
star
41

mav_dji_ros_interface

Interface of DJI autopilot based on its OSDK (3.2)
C++
156
star
42

lidar_undistortion

Catkin package that provides lidar motion undistortion based on an external 6DoF pose estimation input.
C++
145
star
43

programming_guidelines

This repository contains style-guides, discussions, eclipse/emacs auto-formatter for commonly used programming languages
Emacs Lisp
139
star
44

tsdf-plusplus

TSDF++: A Multi-Object Formulation for Dynamic Object Tracking and Reconstruction
C++
135
star
45

odom_predictor

Integrates an IMU to predict future odometry readings
C++
134
star
46

depth_segmentation

A collection of segmentation methods working on depth images
C++
133
star
47

grid_map_geo

Geolocalization for grid map using GDAL.
C++
129
star
48

neuralblox

Real-time Neural Representation Fusion for Robust Volumetric Mapping
Python
127
star
49

StructuralInspectionPlanner

ASL Structural Inspection Planner
C++
108
star
50

phaser

A robust pointcloud registration pipeline based on correlation.
C++
106
star
51

eth_supermegabot

Instructions for ETH center for robotics summer school 2019.
Python
102
star
52

terrain-navigation

Repository for Safe Low Altitude Navigation in steep terrain for fixed-wing Aerial Vehicles
C++
98
star
53

waypoint_navigator

Stand-alone waypoint navigator
C++
96
star
54

ethzasl_xsens_driver

Driver for xsens IMUs
Python
96
star
55

mav_tools_public

General launch files, parameters and wiki entries on our systems and related issues
95
star
56

data-driven-dynamics

Data Driven Dynamics Modeling for Aerial Vehicles
Python
94
star
57

reinmav-gym

Reinforcement Learning framework for MAVs using the OpenAI Gym environment
Python
93
star
58

cuckoo_time_translator

algorithms for synchronizing clocks
C++
88
star
59

minkindr

A minimal library for transformations, following the kindr interface. Uses active quaternions of rotation in Hamilton notation.
C++
88
star
60

unreal_airsim

Simulation interface to Unreal Engine 4 based on the AirSim plugin.
C++
87
star
61

waverider

RMPs on multi-resolution occupancy maps for efficient reactive collision avoidance
87
star
62

ethz_piksi_ros

ROS drivers for the Piksi RTK GPS module
C++
85
star
63

sl_sensor

SL Sensor: An open-source, real-time and ROS-based structured light sensor for high accuracy construction robotic applications
C++
84
star
64

voxblox_ground_truth

Create ground truth voxblox maps from Gazebo worlds or .ply files
C++
83
star
65

vicon_bridge

This is a driver providing data from VICON motion capture systems. It is based on the vicon_mocap package from the starmac stacks. Additionally, it can handle multiple subjects / segments and allows to calibrate an origin of the vehicle(s) as this is somehow tedious with the VICON Tracker.
C++
80
star
66

ros-system-monitor

System monitoring tools for ROS.
Python
80
star
67

navrep

Python
73
star
68

curves

A library of curves for estimation.
C++
72
star
69

schweizer_messer

Programming tools for robotics.
C++
65
star
70

time_autosync

Automatically syncs a camera to a rigidly attached IMUs time frame
C++
63
star
71

unreal_cv_ros

Unreal CV ROS Perception Simulator
Python
62
star
72

ai_for_robotics

Programming Exercises Accompanying the Lecture "Artificial Intelligence for Robotics"
Python
60
star
73

lcd

Line Clustering and Description for Place Recognition
C++
59
star
74

trajectory_toolkit

Python tool for analyzing and evaluating trajectory data
Python
59
star
75

dataset_tools

Loader for the generic ASL dataset formats.
MATLAB
58
star
76

rl-navigation

OpenEdge ABL
57
star
77

asl-student-templates

Templates and overview information for student projects at ASL
PostScript
56
star
78

libseekthermal

Driver library for Seek Thermal imaging devices
C++
55
star
79

reactive_avoidance

Reactive obstacle avoidance using raytracing or lidars
C++
52
star
80

plotty

matplotlib-cpp with Eigen interfaces.
C++
52
star
81

forest_gen

Generates randomized Poisson forests to use for UAV collision avoidance evaluations.
Python
49
star
82

3d_vsg

3D Variable Scene Graphs for long-term semantic scene change prediction.
Python
49
star
83

sampling_based_control

Jupyter Notebook
47
star
84

mav_comm

This repository contains message and service definitions used for mavs. All future message definitions go in here, existing ones in other stacks should be moved here where possible.
C++
46
star
85

tmplanner

Terrain monitoring planner
C++
45
star
86

3d3l

Deep Learned Keypoint Detection and Description for 3D LiDARs
Python
44
star
87

fgsp

Jupyter Notebook
44
star
88

autolabel

A project for computing high-quality ground truth training examples for RGB-D data.
Python
43
star
89

mav_gtsam_estimator

A GTSAM based state estimation framework.
C++
43
star
90

visensor_node

Visual inertial SLAM sensor ROS node.
C++
43
star
91

Learn-to-Calibrate

We utilize deep reinforcement learning to obtain favorable trajectories for visual-inertial system calibration.
C++
43
star
92

cvae_exploration_planning

Learning informed sampling distributions and information gains for efficient exploration planning.
Python
42
star
93

active_grasp

Closed-loop next-best view planning for grasp detection in clutter.
Python
41
star
94

two_state_information_filter

C++
41
star
95

ssc_exploration

Incremental 3D Scene Completion for Safe and Efficient Exploration Mapping and Planning
41
star
96

maplab_rovio

Hard-fork of ROVIO to integrate localization.
C++
40
star
97

rtklibros

rtklib with ros interfacing and adapted feedback from external Kalman filter
C
40
star
98

libvisensor

Low level hardware driver for the visual inertial SLAM sensor.
C++
39
star
99

3dsnet

3DSNet: Unsupervised Shape-to-shape 3D Style Transfer
C++
39
star
100

mav_system_identification

Matlab scripts to perform system identification for muti-rotor systems
MATLAB
38
star