path-tracking
There are 44 repositories under path-tracking topic.
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.
zhm-real/MotionPlanning
Motion planning algorithms commonly used on autonomous vehicles. (path planning + path tracking)
Geonhee-LEE/mpc_ros
Differential Wheeled Mobile Robot - Nonlinear Model Predictive Control based on ROS
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.
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.
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.
Pandas-Team/Automatic-Parking
Python implementation of an automatic parallel parking system in a virtual environment, including path planning, path tracking, and parallel parking
winstxnhdw/AutoCarROS2
A virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS 2 and Gazebo.
MizuhoAOKI/path_tracking_catalog
25 path-tracking algorithms are (goint to be) implemented with python.
rsasaki0109/rust_robotics
Rust implementation of PythonRobotics.
bertiniteam/b2
Bertini 2.0: The redevelopment of Bertini in C++.
DongChen06/PathTrackingBicycle
Path tracking with dynamic bicycle models
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.
kohonda/mpc_tracker_ros
Trajectory Tracking Controller for ROS Package Using Nonlinear Model Predictive Control (MPC) with C/GMRES Method
abdulkadrtr/ROS2-PurePursuitControl-PathPlanning-Tracking
Package for Path Planning and Tracking created using ROS2, Turtlebot3, A*, and PurePursuit
winstxnhdw/AutoCarROS
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
MizuhoAOKI/pympc_panoc_ipopt
MPC pathtracking implementation with python, solved by PANOC/IPOPT
team914/autolib-pdfs
This is a series of the best pdfs for use with robots and can be applicable to vex robotics autonmoous routines.
NUS-Advanced-Robotics-Centre/ME5413_Planning_Project
NUS ME5413 Autonomous Mobile Robotics Planning Project
reuben-thomas/fyp-moovita
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
gargivaidya/dubin_model_gymenv
Dubin's Vehicle Model in Gym Environment for Path Tracking using RL Algorithms
yahsiuhsieh/pure-pursuit
Pure pursuit algorithm with PI control
RyuYamamoto/navyu
Autonomous Robot Navigation Packages
duynamrcv/mobile_robot_python
Implement some algorithms and methods for Mobile Robot using Python
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.
balamuruganky/mpc_waypoint_tracking_controller
Model Predictive Control (MPC) based waypoint tracking controller (ROS navigation stack local planner plugin)
automatika-robotics/kompass-core
Blazzingly fast, GPU powered motion planning and control package for robot navigation.
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.
saimj7/Shopping-Analytics
Real-time footfall analysis in retail stores.
Tinker-Twins/Python-Robotics
Python sample codes for robotics algorithms.
ACCESSLab/smc-lateral-controller
This repository contains a sliding mode control option for path tracking in Autoware.Auto
gnestlinger/Path2D
MATLAB class to support path planning and path tracking in robtics and automated driving applications.
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.
emflynn13/robot_moving
This Java-based project aims to efficiently solve the robot pathfinding problem, calculating the path that a robot should take to minimize energy consumption while moving from the top-left corner to the bottom-right corner of a square grid of size n x n. The problem is solved using Dynamic Programming, specifically employing a bottom-up approach.
Jeffery-Chen/tracking_straight_path
Using real-time RGB image for straight path tracking of mobile robots
shassen14/rust_robotics
Robotic algorithms written in rust