autonomous-vehicles
There are 1526 repositories under autonomous-vehicles topic.
ApolloAuto/apollo
An open autonomous driving platform
AtsushiSakai/PythonRobotics
Python sample codes and textbook for robotics algorithms.
microsoft/AirSim
Open source simulator for autonomous vehicles built on Unreal Engine / Unity, from Microsoft AI & Research
carla-simulator/carla
Open-source simulator for autonomous driving research.
autowarefoundation/autoware
Autoware - the world's leading open-source software project for autonomous driving
cyberbotics/webots
Webots Robot Simulator
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)
daohu527/dig-into-apollo
Apollo notes (Apollo学习笔记) - Apollo learning notes for beginners.
microsoft/AutonomousDrivingCookbook
Scenarios, tutorials and demos for Autonomous Driving
manfreddiaz/awesome-autonomous-vehicles
Curated List of Self-Driving Cars and Autonomous Vehicles Resources
generalized-intelligence/GAAS
GAAS is an open-source program designed for fully autonomous VTOL(a.k.a flying cars) and drones. GAAS stands for Generalized Autonomy Aviation System.
cfzd/Ultra-Fast-Lane-Detection
Ultra Fast Structure-aware Deep Lane Detection (ECCV 2020)
ZHOUYI1023/awesome-radar-perception
A curated list of radar datasets, detection, tracking and fusion
jiachenli94/Awesome-Interaction-Aware-Trajectory-Prediction
A selection of state-of-the-art research materials on trajectory prediction
symforce-org/symforce
Fast symbolic computation, code generation, and nonlinear optimization for robotics
LMD0311/Awesome-World-Model
Collect some World Models for Autonomous Driving (and Robotic) papers.
pptacher/probabilistic_robotics
solution of exercises of the book "probabilistic robotics"
NVlabs/VoxFormer
Official PyTorch implementation of VoxFormer [CVPR 2023 Highlight]
cure-lab/MagicDrive
[ICLR24] Official implementation of the paper “MagicDrive: Street View Generation with Diverse 3D Geometry Control”
linorobot/linorobot
Autonomous ground robots (2WD, 4WD, Ackermann Steering, Mecanum Drive)
woven-planet/l5kit
L5Kit - https://woven.toyota
DeepTecher/awesome-autonomous-vehicle
无人驾驶的资源列表中文版
Amin-Tgz/awesome-CARLA
👉 CARLA resources such as tutorial, blog, code and etc https://github.com/carla-simulator/carla
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.
CVPR2023-3D-Occupancy-Prediction/CVPR2023-3D-Occupancy-Prediction
CVPR2023-Occupancy-Prediction-Challenge
h1st-ai/h1st
Power Tools for AI Engineers With Deadlines
AutoRally/autorally
Software for the AutoRally platform
ika-rwth-aachen/Cam2BEV
TensorFlow Implementation for Computing a Semantically Segmented Bird's Eye View (BEV) Image Given the Images of Multiple Vehicle-Mounted Cameras.
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.
StanfordASL/Trajectron-plus-plus
Code accompanying the ECCV 2020 paper "Trajectron++: Dynamically-Feasible Trajectory Forecasting With Heterogeneous Data" by Tim Salzmann*, Boris Ivanovic*, Punarjay Chakravarty, and Marco Pavone (* denotes equal contribution).
daohu527/awesome-self-driving-car
An awesome list of self-driving cars
tier4/AutowareArchitectureProposal.proj
This is the source code of the feasibility study for Autoware architecture proposal.
AtsushiSakai/MATLABRobotics
MATLAB sample codes for mobile robot navigation
karanchawla/GPS_IMU_Kalman_Filter
Fusing GPS, IMU and Encoder sensors for accurate state estimation.