All Projects â†’ gtrll â†’ Gpmp2

gtrll / Gpmp2

Licence: other
Gaussian Process Motion Planner 2

Projects that are alternatives of or similar to Gpmp2

Ompl
The Open Motion Planning Library (OMPL)
Stars: ✭ 598 (+271.43%)
Mutual labels:  robotics, motion-planning
Awesome Robotics Libraries
😎 A curated list of robotics libraries and software
Stars: ✭ 1,159 (+619.88%)
Mutual labels:  robotics, motion-planning
Robotics Toolbox Matlab
Robotics Toolbox for MATLAB
Stars: ✭ 601 (+273.29%)
Mutual labels:  robotics, motion-planning
Rl
The Robotics Library (RL) is a self-contained C++ library for rigid body kinematics and dynamics, motion planning, and control.
Stars: ✭ 391 (+142.86%)
Mutual labels:  robotics, motion-planning
Rvo2 3d
Optimal Reciprocal Collision Avoidance in Three Dimensions (C++)
Stars: ✭ 108 (-32.92%)
Mutual labels:  robotics, motion-planning
Pinocchio
A fast and flexible implementation of Rigid Body Dynamics algorithms and their analytical derivatives
Stars: ✭ 432 (+168.32%)
Mutual labels:  robotics, motion-planning
Awesome Decision Making Reinforcement Learning
A selection of state-of-the-art research materials on decision making and motion planning.
Stars: ✭ 68 (-57.76%)
Mutual labels:  robotics, motion-planning
Toppra
robotic motion planning library
Stars: ✭ 254 (+57.76%)
Mutual labels:  robotics, motion-planning
Safeopt
Safe Bayesian Optimization
Stars: ✭ 90 (-44.1%)
Mutual labels:  robotics, gaussian-processes
Pybullet Planning
PyBullet Planning
Stars: ✭ 89 (-44.72%)
Mutual labels:  robotics, motion-planning
Robotics Toolbox Python
Robotics Toolbox for Python
Stars: ✭ 369 (+129.19%)
Mutual labels:  robotics, motion-planning
Aikido
Artificial Intelligence for Kinematics, Dynamics, and Optimization
Stars: ✭ 133 (-17.39%)
Mutual labels:  robotics, motion-planning
Rvo2
Optimal Reciprocal Collision Avoidance (C++)
Stars: ✭ 264 (+63.98%)
Mutual labels:  robotics, motion-planning
Jetson Inference
Hello AI World guide to deploying deep-learning inference networks and deep vision primitives with TensorRT and NVIDIA Jetson.
Stars: ✭ 5,191 (+3124.22%)
Mutual labels:  robotics, inference
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (+63.35%)
Mutual labels:  robotics, motion-planning
Dynamicwindowapproach
The Dynamic Window Approach planning algorithm written in C with Python Bindings
Stars: ✭ 17 (-89.44%)
Mutual labels:  robotics, motion-planning
AVO2
Reciprocal Collision Avoidance with Acceleration-Velocity Obstacles (C++)
Stars: ✭ 24 (-85.09%)
Mutual labels:  robotics, motion-planning
CLF reactive planning system
This package provides a CLF-based reactive planning system, described in paper: Efficient Anytime CLF Reactive Planning System for a Bipedal Robot on Undulating Terrain. The reactive planning system consists of a 5-Hz planning thread to guide a robot to a distant goal and a 300-Hz Control-Lyapunov-Function-based (CLF-based) reactive thread to co…
Stars: ✭ 21 (-86.96%)
Mutual labels:  robotics, motion-planning
Omplapp
The Open Motion Planning Library (OMPL), GUI + FCL/Assimp integration
Stars: ✭ 83 (-48.45%)
Mutual labels:  robotics, motion-planning
Cleanit
Open-source Autonomy Software in Rust-lang with gRPC for the Roomba series robot vacuum cleaners. Under development.
Stars: ✭ 125 (-22.36%)
Mutual labels:  robotics, motion-planning

GPMP2

This library is an implementation of GPMP2 (Gaussian Process Motion Planner 2) algorithm described in Motion Planning as Probabilistic Inference using Gaussian Processes and Factor Graphs (RSS 2016). The core library is developed in C++ language, and an optional Matlab toolbox is provided. Examples are provided in Matlab scripts. A ROS interface is also available within PIPER.

GPMP2 was developed by Jing Dong and Mustafa Mukadam as part of their work at Georgia Tech Robot Learning Lab.

Prerequisites

  • CMake >= 2.6 (Ubuntu: sudo apt-get install cmake), compilation configuration tool.
  • Boost >= 1.50 (Ubuntu: sudo apt-get install libboost-all-dev), portable C++ source libraries.
  • GTSAM >= 4.0 alpha, a C++ library that implement smoothing and mapping (SAM) framework in robotics and vision. Here we use factor graph implementations and inference/optimization tools provided by GTSAM.

Compilation & Installation

In the library folder execute:

$ mkdir build
$ cd build
$ cmake ..
$ make check  # optional, run unit tests
$ make install

Matlab Toolbox

An optional Matlab toolbox is provided to use our library in Matlab. To enable Matlab toolbox during compilation:

$ cmake -DGPMP2_BUILD_MATLAB_TOOLBOX:OPTION=ON -DGTSAM_TOOLBOX_INSTALL_PATH:PATH=/path/install/toolbox ..
$ make install

After you install the Matlab toolbox, don't forget to add /path/install/toolbox to your Matlab path.

Tested Compatibility

The gpmp2 library is designed to be cross-platform. It has been tested on Ubuntu Linux and Windows for now.

  • Ubuntu: GCC 4.8 - 4.9, 5.3 - 5.4
  • Windows: Visual C++ 2015 (Matlab toolbox not tested)
  • Boost: 1.50 - 1.61

Questions & Bug reporting

Please use Github issue tracker to report bugs. For other questions please contact Jing Dong or Mustafa Mukadam .

Citing

If you use GPMP2 in an academic context, please cite following publications:

@inproceedings{Mukadam-IJRR-18,
  Author = {Mustafa Mukadam and Jing Dong and Xinyan Yan and Frank Dellaert and Byron Boots},
  Title = {Continuous-time {G}aussian Process Motion Planning via Probabilistic Inference},
  journal = {The International Journal of Robotics Research (IJRR)},
  volume = {37},
  number = {11},
  pages = {1319--1340},
  year = {2018}
}

@inproceedings{Dong-RSS-16,
  Author = {Jing Dong and Mustafa Mukadam and Frank Dellaert and Byron Boots},
  Title = {Motion Planning as Probabilistic Inference using {G}aussian Processes and Factor Graphs},
  booktitle = {Proceedings of Robotics: Science and Systems (RSS)},
  year = {2016}
}

@inproceedings{dong2018sparse,
  title={Sparse {G}aussian Processes on Matrix {L}ie Groups: A Unified Framework for Optimizing Continuous-Time Trajectories},
  author={Dong, Jing and Mukadam, Mustafa and Boots, Byron and Dellaert, Frank},
  booktitle={2018 IEEE International Conference on Robotics and Automation (ICRA)},
  pages={6497--6504},
  year={2018},
  organization={IEEE}
}

License

GPMP2 is released under the BSD license, reproduced in the file LICENSE in this directory.

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].