Kinematics and dynamics solvers and controllers.
Link to Doxygen generated documentation: https://robots.uc3m.es/kinematics-dynamics/
Installation instructions for installing from source can be found here.
- Fork the repository
- Create your feature branch (
git checkout -b my-new-feature
) off themaster
branch, following the Forking Git workflow - Commit your changes
- Push to the branch (
git push origin my-new-feature
) - Create a new Pull Request
If you found this project useful, please consider citing the following works:
Bartek Lukawski, Ignacio Montesino Valle, Juan G. Victores, Alberto Jardón, and Carlos Balaguer. An inverse kinematics problem solver based on screw theory for manipulator arms. In XLIII Jornadas de Automática, pages 864–869. Universidade da Coruña, 2022.
@inproceedings{lukawski2022jjaa,
author = {{\L}ukawski, Bartek and Montesino Valle, Ignacio and Victores, Juan G. and Jardón, Alberto and Balaguer, Carlos},
title = {An inverse kinematics problem solver based on screw theory for manipulator arms},
booktitle = {XLIII Jornadas de Automática},
year = {2022},
pages = {864--869},
publisher = {Universidade da Coruña},
doi = {10.17979/spudc.9788497498418.0864},
}
Edwin Daniel Oña, Bartek Lukawski, Alberto Jardón, and Carlos Balaguer. A modular framework to facilitate the control of an assistive robotic arm using visual servoing and proximity sensing. In IEEE Int. Conf. on Autonomous Robot Systems and Competitions (ICARSC), pages 28–33, 2020.
@inproceedings{eona2020icarsc,
author = {{O\~na}, Edwin Daniel and {\L}ukawski, Bartek and Jardón, Alberto and Balaguer, Carlos},
title = {A modular framework to facilitate the control of an assistive robotic arm using visual servoing and proximity sensing},
booktitle = {IEEE Int. Conf. on Autonomous Robot Systems and Competitions (ICARSC)},
year = {2020},
pages = {28--33},
doi = {10.1109/ICARSC49921.2020.9096146},
}
Bartek Lukawski, Juan G. Victores, and Carlos Balaguer. A generic controller for teleoperation on robotic manipulators using low-cost devices. In XLIV Jornadas de Automática, pages 785–788. Universidade da Coruña, 2023.
@inproceedings{lukawski2023jjaa,
author = {{\L}ukawski, Bartek and Victores, Juan G. and Balaguer, Carlos},
title = {A generic controller for teleoperation on robotic manipulators using low-cost devices},
booktitle = {XLIV Jornadas de Automática},
year = {2023},
pages = {785--788},
publisher = {Universidade da Coruña},
doi = {10.17979/spudc.9788497498609.785},
}
- IKFast: Part of OpenRAVE (rdiankov/openrave, roboticslab-uc3m/installation-guides)
- NUKE: The Nearly Universal Kinematic Engine
- ESROCOS/kin-gen: Kinematics code generator by KUL
- AversivePlusPlus/ik
- ros-industrial-consortium/descartes
- IKPy (Phylliade/ikpy)
- uts-magic-lab/Magiks
- tasts-robots/pink: Based on Pinocchio
- orocos/orocos_kinematics_dynamics (roboticslab-uc3m/installation-guides): A dependency of this repository
- iDyn: Library in robotology/icub-main for computing kinematics and dynamics of serial-links chains of revolute joints and limbs
- stack-of-tasks/pinocchio
- RBDL (rbdl/rbdl): Rigid Body Dynamics Library. The code tightly follows the notation used in Roy Featherstone's book "Rigid Body Dynamics Algorithm".
- adityadua24/robopy
- jdj2261/pykin
- All the parts of OpenRAVE (rdiankov/openrave, roboticslab-uc3m/installation-guides) we do not use
- PythonRobotics (AtsushiSakai/PythonRobotics)
- ros-industrial-consortium/trajopt_ros: Trajectory Optimization Motion Planner for ROS (uses http://rll.berkeley.edu/trajopt)
- pantor/ruckig: Online Trajectory Generation. Real-time. Time-optimal. Jerk-constrained.
- https://rosindustrial.org/news/2018/7/5/optimization-motion-planning-with-tesseract-and-trajopt-for-industrial-applications
- ROSPlan (KCL-Planning/ROSPlan): Tools for AI Planning in a ROS system.
- jrl-umi3218/Tasks: It has been used extensively to control humanoid robots such as HOAP-3, HRP-2, HRP-4 and Atlas.
- googlecartographer (org): Cartographer is a system that provides real-time simultaneous localization and mapping (SLAM) in 2D and 3D across multiple platforms and sensor configuration
- roboticslab-uc3m/gait
- roboticslab-uc3m/gaitcontrol
- roboticslab-uc3m/TEOTraGen
- roboticslab-uc3m/footsteps: Includes interesting links
- munozyanez/spgait
- robotology
- epfl-lasa/icub-ds-walking
- stephane-caron
- stephane-caron/lipm_walking_controller (wiki, docker)
- stephane-caron/pymanoid: Humanoid robotics prototyping environment based on OpenRAVE (rdiankov/openrave, roboticslab-uc3m/installation-guides)
- Stack of Tasks (stack-of-tasks (org))
- Humanoid Path Planner (humanoid-path-planner (org))
- AIS-Bonn/humanoid_op_ros: Contains interesting walking motion in ./src/nimbro/motion
- adamlukomski/iva
- pal-robotics
- loco-3d
- https://discourse.ros.org/t/humanoids-sig/1949/12
- isri-aist
- via learning
- DLR-RM/rl-baselines3-zoo includes humanoid (also see pretrained at https://huggingface.co/sb3/tqc-Humanoid-v3)
- https://es.mathworks.com/help/sm/ug/humanoid_walker.html
- nav74neet/ddpg_biped