Topic: "path-tracking"
ai-winter/ros_motion_planning
Motion planning and Navigation of AGV/AMR:ROS planner plugin implementation of A*, JPS, D*, LPA*, D* Lite, Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, PSO, Voronoi, PID, LQR, MPC, DWA, APF, Pure Pursuit etc.
Language: C++ - Size: 140 MB - Last synced at: 15 days ago - Pushed at: 19 days ago - Stars: 2,708 - Forks: 427

zhm-real/MotionPlanning
Motion planning algorithms commonly used on autonomous vehicles. (path planning + path tracking)
Language: Python - Size: 22.8 MB - Last synced at: 11 days ago - Pushed at: over 1 year ago - Stars: 2,377 - Forks: 595

ai-winter/python_motion_planning
Motion planning(Path Planning and Trajectory Planning/Tracking) of AGV/AMR:python implementation of Dijkstra, A*, JPS, D*, LPA*, D* Lite, (Lazy)Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, Voronoi, PID, DWA, APF, LQR, MPC, RPP, Bezier, Dubins etc.
Language: Python - Size: 17.6 MB - Last synced at: 14 days ago - Pushed at: 15 days ago - Stars: 678 - Forks: 89

ShisatoYano/AutonomousVehicleControlBeginnersGuide
Python sample codes and documents about Autonomous vehicle control algorithm. This project can be used as a technical guide book to study the algorithms and the software architectures for beginners.
Language: Python - Size: 130 MB - Last synced at: 7 days ago - Pushed at: 7 days ago - Stars: 674 - Forks: 110

Geonhee-LEE/mpc_ros
Differential Wheeled Mobile Robot - Nonlinear Model Predictive Control based on ROS
Language: C++ - Size: 2.33 MB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 590 - Forks: 153

MizuhoAOKI/python_simple_mppi
Python implementation of MPPI (Model Predictive Path-Integral) controller to understand the basic idea. Mandatory dependencies are numpy and matplotlib only.
Language: Jupyter Notebook - Size: 36.6 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 367 - Forks: 42

Pandas-Team/Automatic-Parking
Python implementation of an automatic parallel parking system in a virtual environment, including path planning, path tracking, and parallel parking
Language: Python - Size: 1.43 MB - Last synced at: 3 months ago - Pushed at: almost 2 years ago - Stars: 351 - Forks: 81

winstxnhdw/AutoCarROS2
A virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS 2 and Gazebo.
Language: Python - Size: 81.6 MB - Last synced at: 19 days ago - Pushed at: over 2 years ago - Stars: 329 - Forks: 58

rsasaki0109/rust_robotics
Rust implementation of PythonRobotics such as EKF, DWA, Pure Pursuit, LQR.
Language: Rust - Size: 538 KB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 146 - Forks: 9

DongChen06/PathTrackingBicycle
Path tracking with dynamic bicycle models
Language: Python - Size: 740 KB - Last synced at: 15 days ago - Pushed at: almost 5 years ago - Stars: 102 - Forks: 19

bertiniteam/b2
Bertini 2.0: The redevelopment of Bertini in C++.
Language: C++ - Size: 12.3 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 95 - Forks: 35

MizuhoAOKI/path_tracking_catalog
25 path-tracking algorithms are (goint to be) implemented with python.
Language: Jupyter Notebook - Size: 39.3 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 79 - Forks: 2

kohonda/mpc_tracker_ros
Trajectory Tracking Controller for ROS Package Using Nonlinear Model Predictive Control (MPC) with C/GMRES Method
Language: C++ - Size: 3.64 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 28 - Forks: 13

team914/autolib-pdfs
This is a series of the best pdfs for use with robots and can be applicable to vex robotics autonmoous routines.
Size: 63.8 MB - Last synced at: 4 days ago - Pushed at: over 5 years ago - Stars: 25 - Forks: 2

souhaiel1/Longitudinal-and-Lateral-Control-of-an-automotive-vehicle
This repository contains the Matlab code for the lateral and longitudinal control of vehicle modeled based on the Bicycle-Model. This work was carried out by me and my colleague Suleyman as part of the smart transportation course.
Language: MATLAB - Size: 1.76 MB - Last synced at: almost 2 years ago - Pushed at: about 3 years ago - Stars: 24 - Forks: 9

reuben-thomas/fyp-moovita
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
Language: Python - Size: 96 MB - Last synced at: about 1 year ago - Pushed at: almost 4 years ago - Stars: 15 - Forks: 4

winstxnhdw/AutoCarROS Fork of reuben-thomas/fyp-moovita 📦
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
Language: Python - Size: 129 MB - Last synced at: about 1 year ago - Pushed at: about 2 years ago - Stars: 14 - Forks: 2

Retr0-code/auth-traversal
The Vulnerability of GoAhead Service on VStarcam C34S-X4 that allows you to download system.ini configuration file and get login and password.
Language: Python - Size: 1.57 MB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 8 - Forks: 1

NUS-Advanced-Robotics-Centre/ME5413_Planning_Project
NUS ME5413 Autonomous Mobile Robotics Planning Project
Language: C++ - Size: 3.15 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 7 - Forks: 14

gargivaidya/dubin_model_gymenv
Dubin's Vehicle Model in Gym Environment for Path Tracking using RL Algorithms
Language: Python - Size: 10.9 MB - Last synced at: almost 2 years ago - Pushed at: almost 4 years ago - Stars: 7 - Forks: 1

MizuhoAOKI/pympc_panoc_ipopt
Language: Python - Size: 411 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 5 - Forks: 0

abdulkadrtr/ROS2-PurePursuitControl-PathPlanning-Tracking
Package for Path Planning and Tracking created using ROS2, Turtlebot3, A*, and PurePursuit
Language: Python - Size: 50.8 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 5 - Forks: 0

RyuYamamoto/navyu
2D Autonomous Robot Navigation Packages
Language: C++ - Size: 246 KB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 4 - Forks: 0

spsingh37/SelfDriveSuite
This is a comprehensive project focused on developing advanced algorithms for autonomous driving, including adaptive cruise control, model predictive control (MPC), and robust scene understanding in various weather conditions.
Language: Jupyter Notebook - Size: 1.93 GB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 3 - Forks: 0

duynamrcv/mobile_robot_python
Implement some algorithms and methods for Mobile Robot using Python
Language: Python - Size: 738 KB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 3 - Forks: 0

gnestlinger/Path2D
MATLAB class to support path planning and path tracking in robtics and automated driving applications.
Language: MATLAB - Size: 329 KB - Last synced at: 2 months ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

jam643/TheTrolleyProblemGame
This over-engineered game is my attempt to brush up on vehicle dynamics and path tracking algorithms by coding them from scratch. The game conceals an underlying framework of tunable path tracking controllers (Pure-Pursuit, Stanley, Kinematic/Dynamic LQR), customizable vehicle dynamics models, spline-based path generation, etc.
Language: Jupyter Notebook - Size: 30.8 MB - Last synced at: 13 days ago - Pushed at: 8 months ago - Stars: 2 - Forks: 2

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: almost 4 years ago - Stars: 2 - Forks: 0

shassen14/rust_robotics
Robotic algorithms written in rust
Language: Rust - Size: 548 KB - Last synced at: 7 days ago - Pushed at: 8 days ago - Stars: 1 - Forks: 0

vialabpnu/path-following-datasets
Dataset for benchmarking control algorithms in unstructured environments (e.g., parking lots), focusing on low-speed maneuvering precision. Includes 2D HD maps from Pusan National University (PNU) to evaluate autonomous vehicles/robots in real-world constrained scenarios.
Language: Dockerfile - Size: 59.3 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

sr-amr-dev/.github
Repository for setting default templates
Size: 10.7 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

christianbator/pure-pursuit
A pure pursuit implementation in python
Language: Python - Size: 1.7 MB - Last synced at: 28 days ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

georgiosmatzarapis/polaris-gem-e2-manager
This is a high level manager of the Polaris GEM e2. The system behind it, has been built to receive mocked sensor data and control the vehicle's course based on them.
Language: C++ - Size: 112 KB - Last synced at: 28 days ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

ACCESSLab/smc-lateral-controller
This repository contains a sliding mode control option for path tracking in Autoware.Auto
Language: Jupyter Notebook - Size: 17.1 MB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

saimj7/Footfall-Analysis-in-Retail-Stores
Real-time footfall analysis in retail stores.
Language: Python - Size: 120 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

RomainPierre7/genetic_path_tracking
Path tracking by a genetic algorithm. Adjustable settings to try to achieve better results.
Language: Python - Size: 5.86 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

dBenf/Multimedia-Systems
Repository for the final project of Multimedia Systems course
Size: 1.56 MB - Last synced at: about 2 years ago - Pushed at: almost 3 years ago - Stars: 0 - Forks: 0

yahsiuhsieh/pure-pursuit
Pure pursuit algorithm with PI control
Language: Python - Size: 8.83 MB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 1

eugeniu1994/Small-scale-self-driving-car
Applied Artificial Intelligence project course at the Technical University of Berlin. Small scale autonomous driving. Covers basic perception and control algorithm.
Language: C - Size: 417 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 2

cyrilbos/Umu-AI-Fundamentals
Language: Python - Size: 14.7 MB - Last synced at: almost 2 years ago - Pushed at: over 7 years ago - Stars: 0 - Forks: 0
