All Projects → ethz-adrl → Towr

ethz-adrl / Towr

Licence: bsd-3-clause
A light-weight, Eigen-based C++ library for trajectory optimization for legged robots.

Projects that are alternatives of or similar to Towr

Robotics setup
Setup Ubuntu 18.04, 16.04 and 14.04 with machine learning and robotics software plus user configuration. Includes ceres tensorflow ros caffe vrep eigen cudnn and cuda plus many more.
Stars: ✭ 110 (-73.17%)
Mutual labels:  ros, robot, eigen
Unity Robotics Hub
Central repository for tools, tutorials, resources, and documentation for robotics simulation in Unity.
Stars: ✭ 439 (+7.07%)
Mutual labels:  ros, robot, motion-planning
Xpp
Visualization of Motions for Legged Robots in ros-rviz
Stars: ✭ 177 (-56.83%)
Mutual labels:  ros, motion-planning, computer-graphics
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (-35.85%)
Mutual labels:  ros, robot, motion-planning
scikit-robot
A Flexible Framework for Robot Control in Python
Stars: ✭ 70 (-82.93%)
Mutual labels:  robot, motion-planning, ros
Ifopt
An Eigen-based, light-weight C++ Interface to Nonlinear Programming Solvers (Ipopt, Snopt)
Stars: ✭ 372 (-9.27%)
Mutual labels:  ros, eigen
piper
No description or website provided.
Stars: ✭ 50 (-87.8%)
Mutual labels:  motion-planning, ros
robot
Functions and classes for gradient-based robot motion planning, written in Ivy.
Stars: ✭ 29 (-92.93%)
Mutual labels:  robot, motion-planning
ROS-TCP-Connector
No description or website provided.
Stars: ✭ 123 (-70%)
Mutual labels:  robot, ros
urdf-rs
URDF parser using serde-xml-rs for rust
Stars: ✭ 21 (-94.88%)
Mutual labels:  robot, ros
Virtual-Robot-Challenge
How-to on simulating a robot with V-REP and controlling it with ROS
Stars: ✭ 83 (-79.76%)
Mutual labels:  robot, ros
erdos
Dataflow system for building self-driving car and robotics applications.
Stars: ✭ 135 (-67.07%)
Mutual labels:  robot, ros
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 (-93.17%)
Mutual labels:  robot, ros
Robotics-Object-Pose-Estimation
A complete end-to-end demonstration in which we collect training data in Unity and use that data to train a deep neural network to predict the pose of a cube. This model is then deployed in a simulated robotic pick-and-place task.
Stars: ✭ 153 (-62.68%)
Mutual labels:  motion-planning, ros
moveit python
Pure Python Bindings to ROS MoveIt!
Stars: ✭ 107 (-73.9%)
Mutual labels:  robot, ros
conde simulator
Autonomous Driving Simulator for the Portuguese Robotics Open
Stars: ✭ 31 (-92.44%)
Mutual labels:  robot, ros
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (-92.44%)
Mutual labels:  robot, ros
notspot sim py
This repository contains all the code and files needed to simulate the notspot quadrupedal robot using Gazebo and ROS.
Stars: ✭ 41 (-90%)
Mutual labels:  robot, ros
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 (-94.88%)
Mutual labels:  robot, motion-planning
Easy handeye
Automated, hardware-independent Hand-Eye Calibration
Stars: ✭ 355 (-13.41%)
Mutual labels:  ros, robot

A light-weight and extensible C++ library for trajectory optimization for legged robots.

Build Status Documentation ROS hosting CodeFactor License BSD-3-Clause

A base-set of variables, costs and constraints that can be combined and extended to formulate trajectory optimization problems for legged systems. These implementations have been used to generate a variety of motions such as monoped hopping, biped walking, or a complete quadruped trotting cycle, while optimizing over the gait and step durations in less than 100ms (paper).

Features:
✔️ Inuitive and efficient formulation of variables, cost and constraints using Eigen.
✔️ ifopt enables using the high-performance solvers Ipopt and Snopt.
✔️ Elegant rviz visualization of motion plans using xpp.
✔️ ROS/catkin integration (optional).
✔️ Light-weight (~6k lines of code) makes it easy to use and extend.


InstallRunDevelopContributePublicationsAuthors

Install

The easiest way to install is through the ROS binaries:

sudo apt-get install ros-<ros-distro>-towr-ros

In case these don't yet exist for your distro, there are two ways to build this code from source:

  • Option 1: core library and hopper-example with pure CMake.
  • Option 2 (recommended): core library & GUI & ROS-rviz-visualization built with catkin and ROS.

Building with CMake

  • Install dependencies CMake, Eigen, Ipopt:

    sudo apt-get install cmake libeigen3-dev coinor-libipopt-dev
    

    Install ifopt, by cloning the repo and then: cmake .. && make install on your system.

  • Build towr:

    git clone https://github.com/ethz-adrl/towr.git && cd towr/towr
    mkdir build && cd build
    cmake .. -DCMAKE_BUILD_TYPE=Release
    make
    sudo make install # copies files in this folder to /usr/local/*
    # sudo xargs rm < install_manifest.txt # in case you want to uninstall the above
    
  • Test (hopper_example.cc): Generates a motion for a one-legged hopper using Ipopt

    ./towr-example # or ./towr-test if gtest was found
    
  • Use: You can easily customize and add your own constraints and variables to the optimization problem. Herefore, add the following to your CMakeLists.txt:

    find_package(towr 1.2 REQUIRED)
    add_executable(main main.cpp) # Your custom variables, costs and constraints added to TOWR
    target_link_libraries(main PUBLIC towr::towr) # adds include directories and libraries
    

Building with catkin

We provide a ROS-wrapper for the pure cmake towr library, which adds a keyboard interface to modify goal state and motion types as well as visualizes the produces motions plans in rviz using xpp.

  • Install dependencies CMake, catkin, Eigen, Ipopt, ROS, xpp, ncurses, xterm:

    sudo apt-get install cmake libeigen3-dev coinor-libipopt-dev libncurses5-dev xterm
    sudo apt-get install ros-<ros-distro>-desktop-full ros-<ros-distro>-xpp
    
  • Build workspace:

    cd catkin_workspace/src
    git clone https://github.com/ethz-adrl/ifopt.git
    git clone https://github.com/ethz-adrl/towr.git
    cd ..
    catkin_make_isolated -DCMAKE_BUILD_TYPE=Release # or `catkin build`
    source ./devel_isolated/setup.bash
    
  • Use: Include in your catkin project by adding to your CMakeLists.txt

    add_compile_options(-std=c++11)
    find_package(catkin COMPONENTS towr) 
    include_directories(${catkin_INCLUDE_DIRS})
    target_link_libraries(foo ${catkin_LIBRARIES})
    

    Add the following to your package.xml:

    <package>
      <depend>towr</depend>
    </package>
    

Run

Launch the program using

roslaunch towr_ros towr_ros.launch  # debug:=true  (to debug with gdb)

Click in the xterm terminal and hit 'o'.

Information about how to tune the paramters can be found here.

Develop

Library overview

  • The relevant classes and parameters to build on are collected modules.
  • A nice graphical overview as UML can be seen here.
  • The doxygen documentation provides helpful information for developers.

Problem formulation

  • This code formulates the variables, costs and constraints using ifopt, so it makes sense to briefly familiarize with the syntax using this example.
  • A minimal towr example without ROS, formulating a problem for a one-legged hopper, can be seen here and is great starting point.
  • We recommend using the ROS infrastructure provided to dynamically visualize, plot and change the problem formulation. To define your own problem using this infrastructure, use this example as a guide.

Add your own variables, costs and constraints

  • This library provides a set of variables, costs and constraints to formulate the trajectory optimization problem. An example formulation of how to combine these is given, however, this formulation can probably be improved. To add your own e.g. constraint-set, define a class with it's values and derivatives, and then add it to the formulation nlp.AddConstraintSet(your_custom_constraints); as shown here.

Add your own robot

  • Want to add your own robot to towr? Start here.
  • To visualize that robot in rviz, see xpp.

Contribute

We love pull request, whether its new constraint formulations, additional robot models, bug fixes, unit tests or updating the documentation. Please have a look at CONTRIBUTING.md for more information.
See here the list of contributors who participated in this project.

Projects using towr

Publications

All publications underlying this code can be found here. The core paper is:

@article{winkler18,
  author    = {Winkler, Alexander W and Bellicoso, Dario C and 
               Hutter, Marco and Buchli, Jonas},
  title     = {Gait and Trajectory Optimization for Legged Systems 
               through Phase-based End-Effector Parameterization},
  journal   = {IEEE Robotics and Automation Letters (RA-L)},
  year      = {2018},
  month     = {July},
  pages     = {1560-1567},
  volume    = {3},
  doi       = {10.1109/LRA.2018.2798285},
}

A broader overview of the topic of Trajectory optimization and derivation of the Single-Rigid-Body Dynamics model used in this work: DOI 10.3929/ethz-b-000272432

Authors

Alexander W. Winkler - Initial Work/Maintainer

The work was carried out at the following institutions:

               

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