An open API service providing repository metadata for many open source software ecosystems.

Topic: "model-predictive-controller"

anassinator/ilqr

Iterative Linear Quadratic Regulator with auto-differentiatiable dynamics models

Language: Python - Size: 1.33 MB - Last synced at: 10 months ago - Pushed at: almost 3 years ago - Stars: 358 - Forks: 78

Bharath2/iLQR

iterative Linear Quadratic Regulator with constraints.

Language: Python - Size: 1.36 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 206 - Forks: 43

nicolapiccinelli/libmpc

libmpc++ is a C++ header-only library to solve linear and non-linear MPC

Language: C++ - Size: 1010 KB - Last synced at: 23 days ago - Pushed at: 23 days ago - Stars: 163 - Forks: 22

imoneoi/autonomous_driving_mpc

Model Predictive Controller for Autonomous Driving implemented using ROS and C++

Language: C++ - Size: 13.2 MB - Last synced at: 2 months ago - Pushed at: almost 5 years ago - Stars: 94 - Forks: 30

devsonni/MPC-Implementation

This repository has the code for the nonlinear model predictive controller for target tracking problems with the use of Casadi framework and Matlab simulation environment. 🏎️ ✈️

Language: Python - Size: 1.83 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 47 - Forks: 11

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

Language: MATLAB - Size: 41.8 MB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 43 - Forks: 14

zainkhan-afk/Differential-Drive-Robot-Navigation

A path following differential drive robot controlled using a PID controller and Model Predictive Controller (MPC)

Language: Python - Size: 9.82 MB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 33 - Forks: 8

vvrs/MPPIController

Robot Controls Course Project

Language: MATLAB - Size: 7.18 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 31 - Forks: 20

mez/model_predictive_controller_cpp

This is MPC (model predictive controller) that can predict steering and throttle to drive in a simulator.

Language: C++ - Size: 2.92 MB - Last synced at: about 2 years ago - Pushed at: almost 8 years ago - Stars: 15 - Forks: 9

risherlock/sore

Software recreations of published works.

Language: MATLAB - Size: 5.86 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 13 - Forks: 0

w111liang222/model-predictive-control-UGV

Control steer and throttle of UGV to track the reference path based on model predictive controller

Language: Makefile - Size: 992 KB - Last synced at: over 1 year ago - Pushed at: almost 8 years ago - Stars: 11 - Forks: 4

BreulinG98/MPC-GUI

Graphical user interface for designing and simulating model predictive control using MATLAB and the Multi-Parametric Toolbox 3

Language: MATLAB - Size: 3.24 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 9 - Forks: 6

vikas-rajpoot/Contorl-CSTR-using-Reinforcement-learning

This study explores using RL for CSTR control, assessing effectiveness vs. traditional controllers (PID, MPC). RL learns optimal behavior to maximize rewards, outperforming NMPC with exploration and lower computational load.

Language: Python - Size: 3.31 MB - Last synced at: 6 months ago - Pushed at: 12 months ago - Stars: 8 - Forks: 0

nicolaloi/Model-Predictive-Control

MPC controllers for temperature regulation of a building. Graded project for the ETH course "Model Predictive Control".

Language: MATLAB - Size: 3.54 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 8 - Forks: 5

dddmobilerobot/dddmr_local_planner

DDDMR local planner is the integration of trajectory generator, model critics and recovery behaviors.

Language: C++ - Size: 110 KB - Last synced at: 2 months ago - Pushed at: 8 months ago - Stars: 6 - Forks: 5

AtaberkOKLU/Linear-MPC-Lanekeeping-ObstacleAvoidance

Linear MPC for Lane Keeping and Obstacle Avoidance on Low Curvature Roads - Paper Application

Language: MATLAB - Size: 2.06 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 6 - Forks: 3

jonaylton/mpc-missile

Matlab Files for Master Thesis of Jonaylton at IME (Controle Preditivo NĂŁo-Linear Aplicado ao Sistema de Piloto AutomĂĄtico de MĂ­sseis)

Language: MATLAB - Size: 92.8 KB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 5 - Forks: 2

gergelytakacs/Zaklady-prediktivneho-riadenia

PrĂ­klady pre knihu "ZĂĄklady prediktĂ­vneho riadenia" // Examples for the book "Basics of Predictive Control" (in Slovak)

Language: MATLAB - Size: 14.6 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 5 - Forks: 1

preritj/MPC

Model predictive controller - implementation in C++

Language: C++ - Size: 2.52 MB - Last synced at: about 2 years ago - Pushed at: almost 8 years ago - Stars: 5 - Forks: 4

tiandiao123/MPC-Project

This is a self driving car project of using Model Predictive Control algorithm to help car drive itself

Language: C++ - Size: 56.4 MB - Last synced at: over 2 years ago - Pushed at: almost 8 years ago - Stars: 4 - Forks: 4

mohamedameen93/Vehicle-Steering-Using-Model-Predictive-Control

The main goal of the project is to implement in C++ Model Predictive Control to drive the vehicle around the simulator track.

Language: C++ - Size: 2.47 MB - Last synced at: over 2 years ago - Pushed at: about 7 years ago - Stars: 3 - Forks: 3

shazraz/MPC-Controller

Model Predictive Control implemented in C++

Language: C++ - Size: 3.74 MB - Last synced at: about 2 years ago - Pushed at: over 7 years ago - Stars: 3 - Forks: 3

sorousharghavan/Udacity_SelfDriving_Car_Model_Predictive_Control

Udacity Self Driving Engineer Nanodegree - Term 2 - Project 5 - Model Predictive Control

Language: C++ - Size: 33.7 MB - Last synced at: over 2 years ago - Pushed at: almost 8 years ago - Stars: 3 - Forks: 4

balamuruganky/mpc_waypoint_tracking_controller

Model Predictive Control (MPC) based waypoint tracking controller (ROS navigation stack local planner plugin)

Language: C++ - Size: 2.11 MB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 2 - Forks: 0

m4tice/adb

Automated Driving block week project

Language: Python - Size: 114 MB - Last synced at: 3 months ago - Pushed at: about 4 years ago - Stars: 2 - Forks: 0

awav/model-predictive-controller

Implementation of Model Predictive Control

Language: C++ - Size: 18 MB - Last synced at: 2 months ago - Pushed at: almost 8 years ago - Stars: 2 - Forks: 4

josancamon19/model_predictive_controller

Model Predictive Controller Project for the Self-driving Cars Nanodegree.

Language: C++ - Size: 9.66 MB - Last synced at: 6 days ago - Pushed at: about 6 years ago - Stars: 1 - Forks: 0

polarbeargo/CarND-MPC-Project Fork of udacity/CarND-MPC-Project

CarND Term 2 Model Predictive Control (MPC) Project

Language: C++ - Size: 2.58 MB - Last synced at: about 1 year ago - Pushed at: over 7 years ago - Stars: 1 - Forks: 1

kcg2015/Model-Predictive-Control

Language: C++ - Size: 3.6 MB - Last synced at: over 2 years ago - Pushed at: over 7 years ago - Stars: 1 - Forks: 0

khushant2001/Trajectory-optimization

Real-time trajectory optimization for obstacle avoidance on crazyflie - a mini quadcopter. Both simulation and hardware testing are performed.

Language: C++ - Size: 2.59 MB - Last synced at: 23 days ago - Pushed at: 23 days ago - Stars: 0 - Forks: 0

HariKrishnan06082k/Robot-Learning-for-Planning-and-Control

Topics include function approximation, learning dynamics, using learned dynamics in control and planning, handling uncertainty in learned models, learning from demonstration, and model-based and model-free reinforcement learning.

Language: Jupyter Notebook - Size: 18.4 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

shiivashaakeri/Data-Driven-MPC-Linear-Systems-RL

Z. Sun, Q. Wang, J. Pan and Y. Xia, "Data-Driven MPC for Linear Systems using Reinforcement Learning," 2021 China Automation Congress (CAC), Beijing, China, 2021, pp. 394-399, doi: 10.1109/CAC53003.2021.9728233.

Language: Python - Size: 8.79 KB - Last synced at: about 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

kingsmanvicky/Control-Systems

This repo contains all the codes of my control systems simulations

Language: Python - Size: 15.6 KB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

ashishraste/Model-Predictive-Controller

Model predictive controller for controlling a self-driving car

Language: C++ - Size: 16.7 MB - Last synced at: almost 2 years ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

Labonneguigue/CarND-MPC-Project Fork of udacity/CarND-MPC-Project

Model Predictive Control Project: Laps in Simulation Driven with 100ms Latency

Language: C++ - Size: 3.16 MB - Last synced at: 4 months ago - Pushed at: about 7 years ago - Stars: 0 - Forks: 1

da-phil/SDC-Model-Predictive-Control

Model predictive control project for Udacity Selfdriving Car nanodegree

Language: C++ - Size: 16.5 MB - Last synced at: about 2 years ago - Pushed at: about 7 years ago - Stars: 0 - Forks: 0

henyau/SDC_MPC_Sim

Language: C++ - Size: 2.58 MB - Last synced at: about 2 years ago - Pushed at: about 7 years ago - Stars: 0 - Forks: 0

marthtz/CarND-T2P5-MPC-Project

Implementation of a Model Predictive Controller driving a simulated car.

Language: C++ - Size: 3.63 MB - Last synced at: almost 2 years ago - Pushed at: almost 8 years ago - Stars: 0 - Forks: 0

Related Topics
mpc 19 model-predictive-control 18 control-systems 11 mpc-control 9 self-driving-car 7 autonomous-vehicles 7 matlab 6 pid-controller 5 optimal-control 5 autonomous-driving 4 control 4 trajectory-optimization 4 udacity-self-driving-car 4 cpp 4 c-plus-plus 4 robotics 3 control-theory 3 reinforcement-learning 2 nonlinear-control 2 ros 2 ddp 2 nonlinear-optimization 2 model 2 udacity-nanodegree 2 pid 2 mpc-controller 2 trajectory-tracking 2 local-planner 2 vehicle-control 2 differential-dynamic-programming 2 udacity 2 pendulum 2 ilqr 2 ilqg 2 ipopt 2 path-following 2 casadi 2 dynamics 2 lqg 1 lqg-controller 1 lqr 1 dynamic-programming 1 lqr-controller 1 multirotor 1 crazyflie 1 spacecraft-dynamics-and-control 1 lyapunov-stability 1 pid-control 1 quadcopter 1 carnd 1 lyapunov-functions 1 ros2 1 linear-quadratic-regularization 1 linear-quadratic-estimation 1 beaglebone-blue 1 beaglebone 1 transcription-methods 1 cpp20 1 header-only 1 theano 1 linear-mpc 1 non-linear-optimization 1 dynamics-models 1 nonlinear-mpc 1 self-driving-car-engineer 1 trajectory-generation 1 robot-controller 1 trajectory-prediction 1 mobile-robot 1 differential-drive-robot 1 differential-drive-kinematics 1 visual-studio 1 optimization 1 numba 1 quadrotor 1 nonlinear-dynamics 1 sympy 1 mosek-solver 1 mosek-optimization-toolbox 1 sympy-to-numba 1 mosek-matlab 1 mosek 1 missile 1 mingw-w64 1 rl 1 non-linear-control 1 drl 1 cstr 1 td-learning 1 controller 1 data-driven-control 1 process-controller 1 data-driven 1 matlab-simulation 1 mobile-robots 1 plant-modeling 1 uav 1 carla 1 carla-simulator 1 convolutional-neural-networks 1