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

GitHub topics: pid-control

tttapa/Control-Surface-Motor-Fader

Arduino motorized fader controller, and example code for integration with the Control Surface library.

Language: C++ - Size: 78.1 KB - Last synced at: 1 day ago - Pushed at: about 1 year ago - Stars: 113 - Forks: 10

EthanFrancisco/BotHudson

A Line Follower Robot which uses a PID algorithm that tracks black line and Sumobot which two bots attempts to push each other out of a circle.

Language: C++ - Size: 71.3 KB - Last synced at: 2 days ago - Pushed at: 3 days ago - Stars: 4 - Forks: 0

achyuth-2308/EquiBot-Self-Balancing-Bot

This repository contains the code and schematics for my Self-Balancing Bot, built using Arduino IDE and powered by ESP32 Wroom, MPU6050 Sensor, Motor Driver, & control algorithms. The bot uses PID control to maintain balance & respond to external disturbances. ⚙️ Tech Stack: Arduino IDE, C Programming Language, MPU6050 & L293D Motor Driver.

Language: C - Size: 388 KB - Last synced at: 3 days ago - Pushed at: 4 days ago - Stars: 1 - Forks: 2

PinkFluffyUnic0rn/stm32flight

Flight controller for a small quadcopter

Language: C - Size: 11.3 MB - Last synced at: 3 days ago - Pushed at: 4 days ago - Stars: 2 - Forks: 0

AxxAxx/AxxSolder

STM32 Based soldering station for JBC cartridges, 9-24 VDC and USB-PD power

Language: C - Size: 708 MB - Last synced at: 5 days ago - Pushed at: 23 days ago - Stars: 739 - Forks: 82

Lam-Embedded/Robot-control-by-bluetooth-combined-with-line-detection-using-PID-algorithm

In this project we will try to use bluetooth to control 4-wheel robot. In addition, we will combine with PID algorithm to control line tracking robot.

Language: C++ - Size: 10.7 KB - Last synced at: 7 days ago - Pushed at: 7 days ago - Stars: 1 - Forks: 0

migit/AI-Autonomous-Room-Rover-Robot-A2R3

A2R3- AI Autonomous Room Rover Robot is an open platform, hardware and software AI robotic base for any other robotic platforms to build upon. With these basic functionalities and creating a learning experience for mobile robotic development in mind using very low cost hardware parts and open source software.

Language: C - Size: 150 KB - Last synced at: 7 days ago - Pushed at: 7 days ago - Stars: 3 - Forks: 0

Napattnpp/ATOM

Library that make you code robot faster

Language: C++ - Size: 35.2 KB - Last synced at: 7 days ago - Pushed at: 7 days ago - Stars: 0 - Forks: 0

pramit-majumder/QuadBalance-PID

This is a personal project to help me learn the basics of control systems and controllers. Right now, it's a simple quadcopter that uses a PID controller to maintain stable hovering. I'm currently focusing on getting the hover stable using just PID tuning. I plan to continue improving this project during the summer when I'm back from college.

Size: 1.95 KB - Last synced at: 7 days ago - Pushed at: 9 days ago - Stars: 0 - Forks: 0

ndrplz/self-driving-car

Udacity Self-Driving Car Engineer Nanodegree projects.

Language: C++ - Size: 149 MB - Last synced at: 7 days ago - Pushed at: about 2 years ago - Stars: 2,833 - Forks: 1,390

PowerBroker2/ArduPID

PID library for Arduinos with greater accuracy than the legacy Arduino PID library

Language: C++ - Size: 30.3 KB - Last synced at: 9 days ago - Pushed at: 12 days ago - Stars: 103 - Forks: 26

upkie/upkie

Open-source wheeled biped robots

Language: C++ - Size: 4.45 MB - Last synced at: 8 days ago - Pushed at: 17 days ago - Stars: 254 - Forks: 34

chentyra/Discrete-TimePID

A physically achievable PID controller (discrete-time PID) with noise filter.

Language: Python - Size: 46.9 KB - Last synced at: 1 day ago - Pushed at: 10 months ago - Stars: 3 - Forks: 1

Dennis-van-Gils/python-dvg-pid-controller

PID controller with integral-windup & derivative-kick prevention and bumpless manual-to-auto-mode transfer.

Language: Python - Size: 43.9 KB - Last synced at: 5 days ago - Pushed at: 10 months ago - Stars: 7 - Forks: 2

AmaglioFrancesco/esp_reflow

Esp32 based reflow soldering system

Language: C++ - Size: 11.7 KB - Last synced at: 11 days ago - Pushed at: 11 days ago - Stars: 0 - Forks: 0

JuliaControl/DiscretePIDs.jl

Discrete-time PID controllers in Julia

Language: Julia - Size: 76.2 KB - Last synced at: 11 days ago - Pushed at: 2 months ago - Stars: 22 - Forks: 4

JuliaControl/ControlSystems.jl

A Control Systems Toolbox for Julia

Language: Julia - Size: 278 MB - Last synced at: 7 days ago - Pushed at: 7 days ago - Stars: 539 - Forks: 89

Davidwarchy/learn-quadcopter-pid-altitude

Learning optimal pid values for altitude control. A genetic algorithm is used for this end.

Language: Python - Size: 89.8 KB - Last synced at: 14 days ago - Pushed at: 14 days ago - Stars: 0 - Forks: 0

alpnak/PID_Elevator-Arduino

PID controlled elevator model with Arduino

Language: C++ - Size: 1.27 MB - Last synced at: 14 days ago - Pushed at: 14 days ago - Stars: 1 - Forks: 0

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.

Language: MATLAB - Size: 24.7 MB - Last synced at: 15 days ago - Pushed at: 18 days ago - Stars: 429 - Forks: 67

hnz1102/electricload

Electric Load and Logger

Language: Rust - Size: 1.96 MB - Last synced at: 15 days ago - Pushed at: 4 months ago - Stars: 2 - Forks: 0

Rishikesh-Jadhav/Adaptive-Neural-Network-Based-Control-of-Autonomous-car-in-AirSim

This repository highlights the integration of neural network-based control with PID and MPC approaches in the AirSim simulator to enhance steering inputs for autonomous vehicles. Employing imitation learning and a hybrid neural network architecture, the project aims to create a robust and unbiased model for improved autonomous vehicle control.

Language: Python - Size: 121 MB - Last synced at: 19 days ago - Pushed at: over 1 year ago - Stars: 9 - Forks: 0

ISSUIUC/TARS-Controls

ISS's State-Estimation System for MIDAS avionics system

Language: Python - Size: 301 MB - Last synced at: 15 days ago - Pushed at: 15 days ago - Stars: 6 - Forks: 2

stefapi/PID_tune

A tool for Betaflight or Inav log files to tune PID

Language: Python - Size: 29.5 MB - Last synced at: 11 days ago - Pushed at: almost 4 years ago - Stars: 5 - Forks: 2

lily-osp/AutoTunePID

The AutoTunePID library is an easy-to-use library for Arduino IDE that provides a powerful PID (Proportional, Integral, Derivative) controller with built-in auto-tuning capabilities.

Language: C++ - Size: 151 KB - Last synced at: 2 days ago - Pushed at: 3 days ago - Stars: 2 - Forks: 0

BlagojeBlagojevic/matlab

Simulation of a quoadcopter with a parallel pid controller

Language: MATLAB - Size: 173 KB - Last synced at: 13 days ago - Pushed at: about 3 years ago - Stars: 2 - Forks: 0

jackw01/arduino-pid-autotuner

Automated PID tuning using Ziegler-Nichols/relay method

Language: C++ - Size: 23.4 KB - Last synced at: 21 days ago - Pushed at: over 2 years ago - Stars: 190 - Forks: 61

upkie/pink_balancer

Upkie agent that can balance and crouch

Language: Python - Size: 207 KB - Last synced at: 2 days ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 1

giangnt-cae/automatic-control

This repository contains control algorithms and simulation computations using Matlab software

Language: MATLAB - Size: 1.89 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

equinor/TimeSeriesAnalysis

Library that combines control engineering, dynamic simulation and machine learning on time-series. Developed to describe industrial processes and -automation. Lightweight, robust and fast for use in advanced analytics. Built on .NET to run anywhere.

Language: C# - Size: 6.77 MB - Last synced at: 6 days ago - Pushed at: about 1 month ago - Stars: 14 - Forks: 2

veebch/heat-o-matic

Proportional Integral Derivative controller using pi pico

Language: Python - Size: 4.78 MB - Last synced at: about 15 hours ago - Pushed at: about 1 year ago - Stars: 93 - Forks: 24

ilayn/harold

An open-source systems and controls toolbox for Python3

Language: Python - Size: 3.07 MB - Last synced at: 14 days ago - Pushed at: almost 2 years ago - Stars: 176 - Forks: 19

auralius/LuGre

A full reconstruction of the paper: A new model for control systems with friction (Canudas de Wit et al., 1995, IEEE Transactions on Automatic Control)

Language: MATLAB - Size: 2.87 MB - Last synced at: 6 days ago - Pushed at: about 2 years ago - Stars: 38 - Forks: 12

michalnand/libs_control

python lib for linear quadratic control

Language: Python - Size: 62.2 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 1

thomasonzhou/parallel_manipulator

ball balancing robot with camera feedback

Language: Python - Size: 2.24 MB - Last synced at: 6 days ago - Pushed at: 4 months ago - Stars: 3 - Forks: 0

GuidodiPasquo/AeroVECTOR

Model Rocket Simulator oriented to the design and tuning of active control systems, be them in the form of TVC, Active Fin Control or just parachute deployment algorithms on passively stable rockets. It is able to simulate non-linear actuator dynamics and has some limited Software in the Loop capabilities. The program computes all the subsonic aerodynamic parameters of interest and integrates the 3DOF Equations of Motion to simulate the complete flight.

Language: Python - Size: 20.5 MB - Last synced at: 14 days ago - Pushed at: almost 2 years ago - Stars: 143 - Forks: 13

ThunderTecke/PID_Py

A simple (but complete) PID controller in python

Language: Python - Size: 427 KB - Last synced at: 6 days ago - Pushed at: 11 months ago - Stars: 7 - Forks: 2

lomWs/reti_correttici_PID_digitale

Svolgimento di due esercizi su funzioni di trasferimento in sistemi retroazionati, il primo tramite rete correttrice in così da rispettare le specifiche richieste ed il secondo tramite l'utilizzo di un controllore PID

Size: 1.83 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 0

v1v3x/PIDetect

PID-based Process Control Monitoring using Streamlit & ML. Simulates a first-order system, tracks performance (Rise Time, Overshoot, Settling Time, IAE) & detects anomalies via Isolation Forest. Users can tune PID parameters & visualize real-time behavior. 🚀

Language: Python - Size: 17.6 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 0

uncodead/BrewUNO

High precision and accuracy, open source, online, extensible and low cost homebrew automation on top of ESP8266 microchip.

Language: C++ - Size: 120 MB - Last synced at: 9 days ago - Pushed at: 6 months ago - Stars: 92 - Forks: 43

mwood77/koffie

An open source PID for espresso machines

Language: C++ - Size: 3.02 MB - Last synced at: 9 days ago - Pushed at: about 3 years ago - Stars: 35 - Forks: 3

UnhingedRobotics/2530A-Robot

This is a complete repository of any code done throughout the 2024-2025 VEX High Stakes Season.

Language: C++ - Size: 111 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 3 - Forks: 0

nazaltekin/ur-robotics-force-pid-controller

Design of force PID controller on UR5

Language: Python - Size: 10.7 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 0 - Forks: 0

hari-vickey/ros2_sbr

Self Balancing Robot using ROS2 with Gazebo simulation

Language: Python - Size: 41.8 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 1 - Forks: 0

Dhi13man/edge-surf-pid

Python project that uses OpenCV and PyInput to create a bot that can play the Edge Surf game automatically, without the need for AI or machine learning algorithms.

Language: Python - Size: 28.3 KB - Last synced at: about 1 month ago - Pushed at: over 1 year ago - Stars: 3 - Forks: 1

patrickcollins12/esphome-fan-controller

ESPHome Fan Controller

Size: 5.09 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 472 - Forks: 58

juliosdutra/Controle_de_Processos_UFES

Aplicação de conceitos da disciplina de Controle de Processos.

Language: Jupyter Notebook - Size: 8.25 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 1 - Forks: 0

botprof/PID-101

This repository provides a brief introduction to PID control by using Python examples in Jupyter notebooks.

Language: Jupyter Notebook - Size: 1.11 MB - Last synced at: 8 days ago - Pushed at: about 1 year ago - Stars: 18 - Forks: 2

endiliey/uav-autonomous-landing

:helicopter: Unmanned Aerial Vehicle (Drone) Autonomous Landing

Language: C++ - Size: 4.69 MB - Last synced at: 2 days ago - Pushed at: over 6 years ago - Stars: 29 - Forks: 8

Nadazeineedin/PID-ANN-Fuzzy-SumoBot

This project implements PID, ANN, and Fuzzy Logic Controllers for a DC Encoder Motor in a SUMO Robot. It compares control strategies to enhance stability, responsiveness, and adaptability using MATLAB Simulink and C++. 🚀

Size: 1.8 MB - Last synced at: 11 days ago - Pushed at: 2 months ago - Stars: 1 - Forks: 0

KanishkNavale/Robot-Physics-Engine

This repository implements an optimization strategy for singularity free trajectory generation for the serial robots.

Language: Python - Size: 6.35 MB - Last synced at: 19 days ago - Pushed at: almost 3 years ago - Stars: 9 - Forks: 3

gluonsandquarks/jirachi

Jirachi: self-balancing Reuleaux triangle

Language: C - Size: 69.4 MB - Last synced at: 30 days ago - Pushed at: 2 months ago - Stars: 1 - Forks: 0

SAI-SRIVARDHAN-REDDY-LINGALA/Quadcopter-Altitude-Control-with-PID

Quadcopter Altitude Control with PID

Language: Python - Size: 3.91 KB - Last synced at: 15 days ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

SarwanShah/HU_2019_Tilt-Stablization-Control-System

Designed and constructed an experimental platform (Gimble-like) to keep placed objects positioned on the horizontal plane against disturbances

Language: C++ - Size: 579 KB - Last synced at: about 2 months ago - Pushed at: 2 months ago - Stars: 1 - Forks: 0

exfil0/pi_full_monitor

Pi Full Monitor is a Python-based CLI tool designed for monitoring the performance and health of a Raspberry Pi device in real-time.

Language: Python - Size: 1.45 MB - Last synced at: 29 days ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

M-Stasiak/Projekt_STM32_AutomatycznaRegulacjaTemperatury

Projekt edukacyjny realizujący automatyczną regulację temperatury za pomocą regulatora PID na płytce STM32 NUCLEO H755ZI-Q. Stworzony wyłącznie do celów nauki, bez zamiaru komercyjnego wykorzystania.

Language: C - Size: 1.13 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

domectrl/ha-pid_controller

PID controller integration for HomeAssitant

Language: Python - Size: 93.8 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 0

Tamandutech/LineFollower_SemrehV2_Code

Semreh V2 line-follower robot code.

Language: C++ - Size: 1.96 MB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 3 - Forks: 1

S7our-Squad/RC-CAR-ROS2

A ROS2 project for autonomous car racing RC CAR. Code can run both in the physical car, as well as in simulation.

Language: Python - Size: 849 KB - Last synced at: 11 days ago - Pushed at: 10 months ago - Stars: 4 - Forks: 0

baggepinnen/ActiveDisturbanceRejectionControl.jl

Proof that linear ADRC is equivalent to PI(D) control with set-point weighting

Language: TeX - Size: 1.28 MB - Last synced at: about 1 month ago - Pushed at: 3 months ago - Stars: 1 - Forks: 0

antonysigma/piezo-stage-pid-board

Z-axis stage controller hardware and firmware for Piezo-flexure stage

Language: C++ - Size: 973 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 2 - Forks: 0

focksor/FlightController 📦

Language: C - Size: 3.04 MB - Last synced at: 7 days ago - Pushed at: almost 7 years ago - Stars: 3 - Forks: 0

ranigastmax/PID-regulator-on-Nucleo-F76Zi

Projekt dotyczy systemu sterowania temperaturą na mikrokontrolerze STM32. Umożliwia precyzyjną regulację temperatury o 0,5°C za pomocą przycisków '+' i '-'. Komunikacja z użytkownikiem odbywa się przez UART, a optymalizacja obiektu polega na zmniejszeniu strat ciepła, co poprawia czas stabilizacji.

Language: C - Size: 22.7 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

Skylark0924/System_Identification

The usage of MATLAB System Identification Toolbox and PID parameters adjustment

Language: MATLAB - Size: 5.05 MB - Last synced at: 21 days ago - Pushed at: about 6 years ago - Stars: 56 - Forks: 18

parth-20-07/PID-based-SCARA-Robot-Position-and-Velocity-Control-And-Manipulation

RBE500: Foundation of Robotics Final Project

Language: C++ - Size: 40.8 MB - Last synced at: 14 days ago - Pushed at: over 1 year ago - Stars: 6 - Forks: 1

Blattvorhang/Vehicle-Routing-Sim

Integrated front-end and back-end system for vehicle dispatch, routing, pickup and delivery planning, and control simulation.

Language: Java - Size: 10.6 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 3 - Forks: 0

GeraBriseno/PIDMotorControl

PID control for electric motor using bare metal programming with a STM32F401re nucleo board

Language: C - Size: 15.6 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

vaithak/Semi-Autonomous-Differential-Drive

Code for implementing localization, planning and control in an autonomous car using esp-32 microcontroller.

Language: C - Size: 6.66 MB - Last synced at: 7 days ago - Pushed at: 4 months ago - Stars: 3 - Forks: 1

GadgetAngel/Zero_Overshoot

Voron Printers: this extension allows the Voron user to define a formula to change the Classic PID Kp, Ki, and Kd values so that your heater will experience the smallest amount of overshoot

Language: Python - Size: 46.9 KB - Last synced at: 2 days ago - Pushed at: about 2 years ago - Stars: 4 - Forks: 1

Destination2Unknown/pytuneOPC 📦

PID Logger, Tuner and FOPDT Simulator using OPC-UA

Language: Python - Size: 83 KB - Last synced at: 11 days ago - Pushed at: 9 months ago - Stars: 11 - Forks: 1

AkhilRai28/Robotic-Bot

ROS-based teleoperated and autonomous robot with PID control and sensor integration.

Language: Java - Size: 14 MB - Last synced at: 18 days ago - Pushed at: 9 months ago - Stars: 3 - Forks: 1

kr1zzo-FER/Autonomous-Control-for-H20mni-X

This repository is a part of the Marine-Robotics project at the Faculty of Electrical Engineering and Computing, University of Zagreb

Language: Forth - Size: 14.5 MB - Last synced at: about 2 months ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

kr1zzo-FER/Vehicle-Dynamics-and-Control

This repository is a part of the Vehicle Dynamics and Control laboratory exercises at the Faculty of Electrical Engineering and Computing, University of Zagreb

Size: 37.9 MB - Last synced at: about 2 months ago - Pushed at: about 1 year ago - Stars: 2 - Forks: 0

t1m013y/PIDctrl-c

A PID controller library for C and C++

Language: C - Size: 4.88 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

Keeby-Astro/Auto-Driving-Path-Following-and-Speed-Control

Autonomous Driving Path Following and Speed Control - Final Project for AME-5970-001: Dynamics/Control Auto Driving

Language: Python - Size: 12.2 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 1

kitune-san/PID_Controller_Collection

PID Controller Collection (Speed-Type, Integer(non-float)-Mode) Written in C

Language: C - Size: 15.6 KB - Last synced at: about 2 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

shinowtf/DESIGN-AND-ANALYZE-A-FEEDBACK-CONTROLLER-TO-IMPROVE-LIFT-DOOR

My Lab work. Investigate the design and execution of a PID (ProportionalIntegral-Derivative) controller to manage the speed of the DC motor driving the lift door. The aim is to manage the motor speed to effectively control the lift door's movement.

Language: MATLAB - Size: 2.3 MB - Last synced at: about 2 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

baggepinnen/TrajectoryLimiters.jl

Nonlinear filters to create dynamically feasible reference trajectories

Language: Julia - Size: 14.6 KB - Last synced at: 5 days ago - Pushed at: 5 months ago - Stars: 17 - Forks: 1

BanaanKiamanesh/Anti-Windup-PID-Controller

This is a C++ Library for Anti Windup PID Controller!

Language: C++ - Size: 1.95 KB - Last synced at: 14 days ago - Pushed at: over 3 years ago - Stars: 14 - Forks: 1

GCY/Atrial-Fibrillation-Detection-Blood-Pressure-Monitor-Oscillometric-Method-

Atrial Fibrillation Detection Blood Pressure Monitor (Oscillometric Method)

Language: C - Size: 37 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 48 - Forks: 18

Gowtham1729/Ball-on-Plate

Language: Python - Size: 6.84 KB - Last synced at: 4 days ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

mreff555/TempCtrl

A framework for a multi-core, software driven PID temperature controller. Designed to run on embedded systems.

Language: C++ - Size: 117 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 2 - Forks: 0

ACHKHE/3DOF-VTVL-ROCKET-TVC-Simulation

Language: C++ - Size: 1.91 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

Loki-Silvres/Hologlyph-Bots

Autonomous drawing robots with a 3 wheeled holonomic drive, completely run using ROS2.

Language: Python - Size: 42.1 MB - Last synced at: 4 days ago - Pushed at: 5 months ago - Stars: 3 - Forks: 1

rruiter87/TcControl

TwinCAT library for PID control and signal filtering

Language: Python - Size: 1.07 MB - Last synced at: 7 days ago - Pushed at: about 1 year ago - Stars: 32 - Forks: 2

KierPrev/PIDController

Tempering control using a PID (Proportional-Integral-Derivative) controller, results data analysis

Language: R - Size: 407 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

massmr/pid_tracker

Projet pointeur rouge - projet beta Adimaker 24/25

Language: Python - Size: 184 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

xalpol12/pid-controller-with-resistor-heating

PID regulation using STM32 controller with first order inertial thermal object (ceramic resistor)

Language: C - Size: 15.8 MB - Last synced at: 8 days ago - Pushed at: almost 2 years ago - Stars: 4 - Forks: 0

LCC-Automation/OpenPID-TIA-SCL

An open source PID controller with step tuning created with Siemens TIA Portal 19 in SCL

Size: 1.32 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

SuDaxia-kai/Balance_car

The motivation to do this project is to complete the course design of Computer Control in GDUT. This project uses STM32F1RCT6, MPU6050, MG513P30_12V as the main devices to carry the balance car, and the development language is C. The functions such as Mahony attitude calculation and PPM remote control are realized.

Language: C - Size: 23 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 4 - Forks: 0

dvdvideo1234/ControlSystemsE2

Control theory and fast traces E2 extension

Language: Lua - Size: 821 KB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 3 - Forks: 1

YashBansod/Electric_Drives_Power_Electronics

This drive contains all the Matlab and Simulink codes and files for the Electric Drives and Power Electronics Design, Simulation and Analysis.

Language: Matlab - Size: 476 KB - Last synced at: 20 days ago - Pushed at: about 8 years ago - Stars: 16 - Forks: 4

NEWIR295/ROS_PID_TUNNING

PID tunning for motors using ROS

Language: C++ - Size: 16.6 KB - Last synced at: 23 days ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

Mavengers/DonkeyDrift

Open-source self-driving car based on DonkeyCar and programmable chassis

Language: Python - Size: 3.15 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 15 - Forks: 3

Javgilavi/Crazyflie-Autonomous-Navigation

Autonomous navigation system for a Crazyflie quadrotor in Webots simulator. Utilizes A* path planning algorithm and integrates real-time object recognition with YOLO.

Language: Python - Size: 0 Bytes - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

Papaglory/PID-Rocket-Simulator

Simulator featuring PID controllers for simulating stable rocket movement and rotation in 3D space. Designed to efficiently manage altitude and rotations towards a target location within Unity's physics engine.

Language: C# - Size: 343 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

kmilo17pet/qlibs

A collection of useful libraries for embedded systems : signal smoothing, PID control, Fuzzy Logic, fixed-point math and more...

Language: C - Size: 2.32 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 65 - Forks: 16

kmilo17pet/qlibs-cpp

C++ version of qlibs, a collection of useful libraries for embedded systems : signal smoothing, PID control, Fuzzy Logic, fixed-point math and more...

Language: C++ - Size: 8.42 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 13 - Forks: 1

Tinker-Twins/PID-Controller

PID Controller

Language: C++ - Size: 7.81 KB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 2 - Forks: 0

brown9804/EngineeringSimulationsHub

This repository hosts a variety of simulations, and designs. Each simulation/design is contained in its own directory.

Language: MATLAB - Size: 17.4 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

Related Keywords