All Projects → uos → Mesh_navigation

uos / Mesh_navigation

Licence: bsd-3-clause
ROS Mesh Navigation Bundle

Projects that are alternatives of or similar to Mesh navigation

Turtlebot3
ROS packages for Turtlebot3
Stars: ✭ 673 (+490.35%)
Mutual labels:  ros, navigation
Missionplanner
Mission Planner Ground Control Station (c# .net)
Stars: ✭ 1,059 (+828.95%)
Mutual labels:  ros, control
Fourth robot pkg
4号機(KIT-C4)用リポジトリ
Stars: ✭ 7 (-93.86%)
Mutual labels:  ros, navigation
Handycontrols
Contains some simple and commonly used WPF controls based on HandyControl
Stars: ✭ 347 (+204.39%)
Mutual labels:  navigation, control
Navigation
ROS Navigation stack. Code for finding where the robot is and how it can get somewhere else.
Stars: ✭ 1,248 (+994.74%)
Mutual labels:  ros, navigation
Spot mini mini
Dynamics and Domain Randomized Gait Modulation with Bezier Curves for Sim-to-Real Legged Locomotion.
Stars: ✭ 426 (+273.68%)
Mutual labels:  ros, control
Bebops
BebopS aims to simulate the behavior of Parrot Bebop 2 by using SIL methodologies
Stars: ✭ 40 (-64.91%)
Mutual labels:  ros, control
kr mav control
Code for quadrotor control
Stars: ✭ 31 (-72.81%)
Mutual labels:  control, ros
Navbot
Using RGB Image as Visual Input for Mapless Robot Navigation
Stars: ✭ 111 (-2.63%)
Mutual labels:  ros, navigation
Grid map
Universal grid map library for mobile robotic mapping
Stars: ✭ 1,135 (+895.61%)
Mutual labels:  ros, navigation
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (+130.7%)
Mutual labels:  ros, control
Turtlebot3 simulations
Simulations for TurtleBot3
Stars: ✭ 104 (-8.77%)
Mutual labels:  ros, navigation
RustRobotics
Rust implementation of PythonRobotics such as EKF, DWA, Pure Pursuit, LQR.
Stars: ✭ 40 (-64.91%)
Mutual labels:  control, navigation
Teb local planner
An optimal trajectory planner considering distinctive topologies for mobile robots based on Timed-Elastic-Bands (ROS Package)
Stars: ✭ 493 (+332.46%)
Mutual labels:  ros, navigation
Turtlebot Navigation
This project was completed on May 15, 2015. The goal of the project was to implement software system for frontier based exploration and navigation for turtlebot-like robots.
Stars: ✭ 28 (-75.44%)
Mutual labels:  navigation, ros
Tianbot racecar
DISCONTINUED - MIGRATED TO TIANRACER - A Low cost Autonomous Driving Car Educational and Competition Kit
Stars: ✭ 26 (-77.19%)
Mutual labels:  ros, navigation
wpr simulation
No description or website provided.
Stars: ✭ 24 (-78.95%)
Mutual labels:  navigation, ros
auv gnc
Guidance, Navigation, and Control library for AUVs
Stars: ✭ 34 (-70.18%)
Mutual labels:  control, navigation
Mrs uav system
The entry point to the MRS UAV system.
Stars: ✭ 64 (-43.86%)
Mutual labels:  ros, control
Mrpt navigation
ROS nodes wrapping core MRPT functionality: localization, autonomous navigation, rawlogs, etc.
Stars: ✭ 90 (-21.05%)
Mutual labels:  ros, navigation

Mesh Navigation

The Mesh Navigation bundle provides software to perform efficient robot navigation on 2D-manifolds in 3D represented as triangular meshes. It allows to safely navigate in various complex outdoor environments by using a modular extendable layerd mesh map. Layers can be loaded as plugins and represent certain geometric or semantic metrics of the terrain. The layered mesh map is integrated with Move Base Flex (MBF) which provides a universal ROS action interface for path planning and motion control, as well as for recovery behaviours. Thus, additional planner and controller plugins running on the layered mesh map are provided.

Maintainer: Sebastian Pütz
Author: Sebastian Pütz

Demo Gif

Installation

Please use the official released ros package or install more recent versions from source.

sudo apt install ros-melodic-mesh-navigation

Installation from source
All dependencies can be installed using rosdep
rosdep install mesh_navigation

As explicit dependencies we refer to the following ROS packages, which are also developed by us:

Use the pluto_robot package for example HDF5 map datasets, Gazebo simulations, and example configurations.

Software Stack

This mesh_navigation stack provides a navigation server for Move Base Flex (MBF). It provides a couple of configuration files and launch files to start the navigation server with the configured layer plugins for the layered mesh map, and the configured planners and controller to perform path planning and motion control in 3D (or more specifically on 2D-manifold).

The package structure is as follows:

  • mesh_navigation The corresponding ROS meta package.

  • mbf_mesh_core contains the plugin interfaces derived from the abstract MBF plugin interfaces to initialize planner and controller plugins with one mesh_map instance. It provides the following three interfaces:

    • MeshPlanner - mbf_mesh_core/mesh_planner.h
    • MeshController - mbf_mesh_core/mesh_controller.h
    • MeshRecovery - mbf_mesh_core/mesh_recovery.h
  • mbf_mesh_nav contains the mesh navigation server which build on top of the abstract MBF navigation server. It uses the plugin interfaces in mbf_mesh_core to load and initialize plugins of the types described above.

  • mesh_map contains an implementation of a mesh map representation building on top of the mesh data structures in lvr2. This package provides a layered mesh map implementation. Layers can be loaded as plugins to allow a highly configurable 3D navigation stack for robots traversing on the ground in outdoor and rough terrain.

  • mesh_layers The package provides a couple of mesh layers to compute the trafficability of the terrain. Furthermore, these plugins have access to the HDF5 map file and can load and store layer information. The mesh layers can be configured for the robots abilities and needs. Currently we provide the following layer plugins:

    • HeightDiffLayer - mesh_layers/HeightDiffLayer
    • RoughnessLayer - mesh_layers/RoughnessLayer
    • SteepnessLayer - mesh_layers/SteepnessLayer
    • RidgeLayer - mesh_layer/RidgeLayer
    • InflationLayer - mesh_layers/InflationLayer
  • dijkstra_mesh_planner contains a mesh planner plugin providing a path planning method based on Dijkstra's algorithm. It plans by using the edges of the mesh map. The propagation start a the goal pose, thus a path from every accessed vertex to the goal pose can be computed. This leads in a sub-optimal potential field, which highly depends on the mesh structure.

  • wave_front_planner contains a Fast Marching Method (FMM) wave front path planner to take the 2D-manifold into account. This planner is able to plan over the surface, due to that it results in shorter paths than the dijkstra_mesh_planner, since it is not restricted to the edges or topology of the mesh. A comparison is shown below.

  • mesh_client Is an experimental package to load navigation meshes only from a mesh server.

Path Planning and Motion Control

Use the MeshGoal tool to select a goal pose on the shown mesh in RViz.

Mesh Map

Mesh Layers

The following table gives an overview of all currently implemented layer plugins available in the stack and the corresponding types tp specify for usage in the mesh map configuration. An example mesh map configuration is shown below.

Overview of all layers

Layer Plugin Type Specifier Description of Cost Computation Example Image
HeightDiffLayer mesh_layers/HeightDiffLayer local radius based height differences HeightDiffLayer
RoughnessLayer mesh_layers/RoughnessLayer local radius based normal fluctuation RoughnessLayer
SteepnessLayer mesh_layers/SteepnessLayer arccos of the normal's z coordinate SteepnessLayer
RidgeLayer mesh_layer/RidgeLayer local radius based distance along normal RidgeLayer
InflationLayer mesh_layers/InflationLayer by distance to a lethal vertex InflationLayer

Planners

Usage with Move Base Flex

Currently the following planners are available:

Dijkstra Mesh Planner

  - name: 'dijkstra_mesh_planner'
    type: 'dijkstra_mesh_planner/DijkstraMeshPlanner'

Vector Field Planner

  - name: 'wave_front_planner'
    type: 'wave_front_planner/WaveFrontPlanner'

MMP Planner

  - name: 'mmp_planner'
    type: 'mmp_planner/MMPPlanner'

The planners are compared to each other.

Vector Field Planner Dijkstra Mesh Planner ROS Global Planner on 2.5D DEM
VectorFieldPlanner DijkstraMeshPlanner 2D-DEM-Planner

Controllers

Simulation

If you want to test the mesh navigation stack with Pluto please use the simulation setup and the corresponding launch files below for the respective outdoor or rough terrain environment. The mesh tools have to be installed. We developed the Mesh Tools as a package consisting of message definitions, RViz plugins and tools, as well as a persistence layer to store such maps. These tools make the benefits of annotated triangle maps available in ROS and allow to publish, edit and inspect such maps within the existing ROS software stack.

Demos

In the following demo videos we used the developed VFP, i.e., the wavefront_propagatn_planner. It will be renamed soon to vector_field_planner.

Dataset and Description Demo Video
Botanical Garden of Osnabrück University Mesh Navigation with Pluto
Stone Quarry in the Forest Brockum Mesh Navigation with acron19

Stone Quarry in the Forest in Brockum

Colored Point Cloud Height Diff Layer RGB Vertex Colors
StoneQuarryPointCLoud StoneQuarryHeightDiff StoneQuarryVertexColors

Build Status

ROS Distro GitHub CI Develop Documentation Source Deb Binary Deb
Melodic Melodic CI Build Dev Status Build Doc Status Build Src Status Build Bin Status
Noetic Noetic CI Build Dev Status Build Doc Status Build Src Status Build Bin Status
Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].