mpc-control
There are 184 repositories under mpc-control topic.
google-deepmind/mujoco_mpc
Real-time behaviour synthesis with MuJoCo, using Predictive Control
ai-winter/matlab_motion_planning
Motion planning and Navigation of AGV/AMR:matlab implementation of Dijkstra, A*, Theta*, JPS, D*, LPA*, D* Lite, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, Voronoi, PID, LQR, MPC, APF, RPP, DWA, DDPG, Bezier, B-spline, Dubins, Reeds-Shepp etc.
anassinator/ilqr
Iterative Linear Quadratic Regulator with auto-differentiatiable dynamics models
Pandas-Team/Automatic-Parking
Python implementation of an automatic parallel parking system in a virtual environment, including path planning, path tracking, and parallel parking
pocketxjl/humanoid-control
A humanoid bipedal walking control repo using NMPC and WBC, and simulation with mujoco. Contact: xuejl2001@mail.ustc.edu.cn
hanruihua/RDA-planner
[RA-Letter 2023] RDA: An Accelerated Collision Free Motion Planner for Autonomous Navigation in Cluttered Environments
HybridRobotics/NMPC-DCLF-DCBF
A collection of work using nonlinear model predictive control (NMPC) with discrete-time control Lyapunov functions (CLFs) and control barrier functions (CBFs)
HybridRobotics/MPC-CBF
"Safety-Critical Model Predictive Control with Discrete-Time Control Barrier Function" by J. Zeng, B. Zhang and K. Sreenath https://arxiv.org/abs/2007.11718
Bharath2/iLQR
iterative Linear Quadratic Regulator with support for constraints on input and state variables via barrier functions—Numba-accelerated.
dasGringuen/assetto_corsa_gym
Assetto Corsa OpenAI Gym Environment
xiaoyuyang0901/Simulation-platform
Simulation platform for autonomous vehicle motion planning and control
Marksman007577/Autonomous-Drive
Autonomous Vehicle modelling using MATLAB and Simulink
kousheekc/nmpc_px4_ros2
ROS2 package that implements a nonlinear model predictive control (NMPC) pipeline for trajectory tracking for aerial vehicles that use the PX4 Autopilot
alexdada555/Modelling-Simulation-and-Implementation-of-Linear-Control-for-Asymmetric-Multirotor-UAVs
Master's Thesis Project: Design, Development, Modelling and Simulating of a Y6 Multi-Rotor UAV, Imlementing Control Schemes such as Proportional Integral Derivative Control, Linear Quadratic Gaussian Control and Model Predictive Control on a BeagleBone Blue
priest-yang/Deep-Tracking-Control
Unofficial implementaton of the paper DTC: Deep Tracking Control
shiivashaakeri/Data-Driven-Model-Predictive-Control-MPC-with-Stability-and-Robustness-Guarantees
J. Berberich, J. Köhler, M. A. Müller and F. Allgöwer, "Data-Driven Model Predictive Control With Stability and Robustness Guarantees," in IEEE Transactions on Automatic Control, vol. 66, no. 4, pp. 1702-1717, April 2021, doi: 10.1109/TAC.2020.3000182.
Walid-khaled/autonomous_mobile_robots
This repository contains different aspects of autonomous mobile robots including motion, control, and estimation. PID, LQR, and MPC controllers for differential drive robot are developed with ROS2. In addition, some filters are covered such as particle filter and ekf for localization.
homangab/gradcem
Code for the paper Model-Predictive Control via Cross-Entropy and Gradient-Based Optimization
imgeorgiev/ddp
Differential Dynamic Programming (DDP) with automatic symbolic differentiation
rui-huang-opt/tmpc
A rigid-tube based robust MPC python package.
vipulkumbhar/AuE893_Robust_Predictive_Control
This repository contains classwork and practice examples based on Model Predictive Control. Robust and Stochastic control methods applied to and studied for linear/non-linear plants.
HitSZwang/mini-cheetah-pybullet
mpc and wbc for mini cheetah in pybullet
abwerby/Model-Predictive-Control-Carla
Model Predictive Controller tested on Carla simulator on Race track with reference velocity.
neobotix/neo_mpc_planner2
Omnidirectional planner for mobile robots based on MPC
gustavomoers/CollisionAvoidance-Carla-DRL-MPC
A hybrid collision avoidance system combining Deep Reinforcement Learning with Model Predictive Control, designed for autonomous vehicles in CARLA to navigate scenarios with stationary obstacles.
HuKangle/Trajectory-tracking-for-vehicle
Vehicle path following using the MPC or LQR algorithm
roscibely/MPC-control-with-LMIs
MODEL PREDICTIVE CONTROL (MPC) CONTROL BASED ON THE QUASI-MIN-MAX ALGORITHM WITH RELAXATION IN LMIS
nicolaloi/MPC-Spacecraft-Asteroids-Environment
RRT*-MPC path planning for spacecraft navigation in dynamic environment. Graded project for the ETH course "Planning and Decision Making for Autonomous Robots".
PepMS/eagle-mpc
EagleMPC is a model predictive control & optimal control library for unmanned aerial manipulators (UAMs)
Thomas-JHR/Unmanned-Surface-Vessel-Studies
A Master of Engineering Academic Project
i-abr/TorchMPC
Pytorch implementation of Model Predictive Control with learned models
TinyMPC/tinympc-python
Python interactive interface for TinyMPC
UVAdMIST/swmm_mpc
Python package for model predictive control (MPC) for EPASWMM5 models
UtkarshMishra04/DMD-MPC-RL
This repository contains the code for our paper on Dynamic Mirror Descent based MPC for Model-Free RL