wgx-chanshi's Stars
TheAlgorithms/Python
All Algorithms implemented in Python
jackfrued/Python-100-Days
Python - 100天从新手到大师
rlabbe/Kalman-and-Bayesian-Filters-in-Python
Kalman Filter book using Jupyter Notebook. Focuses on building intuition and experience, not formal proofs. Includes Kalman filters,extended Kalman filters, unscented Kalman filters, particle filters, and more. All exercises include solutions.
zhm-real/PathPlanning
Common used path planning algorithms with animations.
wangshusen/DeepLearning
BehaviorTree/BehaviorTree.CPP
Behavior Trees Library in C++. Batteries included.
osqp/osqp
The Operator Splitting QP Solver
mherb/kalman
Header-only C++11 Kalman Filtering Library (EKF, UKF) based on Eigen3
erwincoumans/motion_imitation
Code accompanying the paper "Learning Agile Robotic Locomotion Skills by Imitating Animals"
google-deepmind/mujoco_mpc
Real-time behaviour synthesis with MuJoCo, using Predictive Control
roboterax/humanoid-gym
Humanoid-Gym: Reinforcement Learning for Humanoid Robot with Zero-Shot Sim2Real Transfer https://arxiv.org/abs/2404.05695
ethz-adrl/towr
A light-weight, Eigen-based C++ library for trajectory optimization for legged robots.
CHH3213/chhRobotics_CPP
自动驾驶规划控制常用算法c++代码实现
MatthewPeterKelly/OptimTraj
A trajectory optimization library for Matlab
bridgedp/hunter_bipedal_control
An open source bipedal robot control framework, based on non-linear MPC and WBC, tailered for EC-hunter80-v01 bipedal robot.
tesseract-robotics/trajopt
Trajectory Optimization Motion Planner for ROS
MingshanHe/Compliant-Control-and-Application
Compliant Control: 1) admittance control algorithm 2) impedance control algorithm 3) hybrid force&position algorithm in robotic arm (Universal Robot).
unitreerobotics/unitree_guide
Derek-TH-Wang/quadruped_ctrl
MIT mini cheetah quadruped robot simulated in pybullet environment using ros.
Optimal-Control-16-745/lecture-notebooks-2023
cdsousa/SymPyBotics
[UNMAINTAINED] Symbolic Framework for Modeling and Identification of Robot Dynamics
matheecs/ocs2_legged_robot_notes
fdevinc/ungar
Simplifying optimal control with metaprogramming
yxyang/locomotion_simulation
kaixindelele/Mujoco-Issues
欢迎大家在issues中挂自己mujoco开发过程中遇到的问题,也欢迎大家去帮忙解决其他人的问题,互相学习互相进步。
GabrielEGC/IHMC-Robotics
Work done in IHMC Robotics since Aug 2019
JameScottX/Virtual-suspension
Virtual suspension model keeps balance by feet point contact
StochLab/SlopedTerrainLinearPolicy
Robust quadrupedal locomotion on sloped terrains: A linear policy approach.
timethy/eth-17fs-mpc
Summary for MPC 2017 at ETH Zürich
lukechencqu/laikago_trotting_up_stairs
RAL2021与IROS2021论文对应的源码:宇树laikago用trot爬台阶,4种全局落脚点规划方法:default, nominal, centroid, optimization