All Projects → singlavinod → Self-Driving-Car-NanoDegree-Udacity

singlavinod / Self-Driving-Car-NanoDegree-Udacity

Licence: MIT License
This repository contains code and writeups for projects and labs completed as a part of UDACITY's first of it's kind self driving car nanodegree program.

Programming Languages

C++
36643 projects - #6 most used programming language
Jupyter Notebook
11667 projects
fortran
972 projects
c
50402 projects - #5 most used programming language
CMake
9771 projects
Cuda
1817 projects

Projects that are alternatives of or similar to Self-Driving-Car-NanoDegree-Udacity

fusion-ekf
An extended Kalman Filter implementation in C++ for fusing lidar and radar sensor measurements.
Stars: ✭ 113 (+289.66%)
Mutual labels:  udacity, sensor-fusion, extended-kalman-filters
Model-Predictive-Control
C++ implementation of Model Predictive Control(MPC)
Stars: ✭ 51 (+75.86%)
Mutual labels:  udacity, autonomous-vehicles, model-predictive-control
ai for robotics
Visualizations of algorithms covered in Sebastian Thrun's excellent Artificial Intelligence for Robotics course on Udacity.
Stars: ✭ 125 (+331.03%)
Mutual labels:  udacity, localization, pid-control
pyUKF
Unscented kalman filter (UKF) library in python that supports multiple measurement updates
Stars: ✭ 52 (+79.31%)
Mutual labels:  unscented-kalman-filter, sensor-fusion
JuliaAutonomy
Julia sample codes for Autonomy, Robotics and Self-Driving Algorithms.
Stars: ✭ 21 (-27.59%)
Mutual labels:  localization, autonomous-vehicles
orientation tracking-unscented kalman filter
Implemented Unscented Kalman Filter (UKF) for orientation tracking. Sensors fusion of accelerometer, and gyroscope
Stars: ✭ 39 (+34.48%)
Mutual labels:  unscented-kalman-filter, sensor-fusion
Particle Filter Prototype
Particle Filter Implementations in Python and C++, with lecture notes and visualizations
Stars: ✭ 29 (+0%)
Mutual labels:  udacity, localization
GA SLAM
🚀 SLAM for autonomous planetary rovers with global localization
Stars: ✭ 40 (+37.93%)
Mutual labels:  localization, sensor-fusion
highway-path-planning
My path-planning pipeline to navigate a car safely around a virtual highway with other traffic.
Stars: ✭ 39 (+34.48%)
Mutual labels:  udacity, autonomous-vehicles
CarND-Extended-Kalman-Filter-P6
Self Driving Car Project 6 - Sensor Fusion(Extended Kalman Filter)
Stars: ✭ 24 (-17.24%)
Mutual labels:  sensor-fusion, extended-kalman-filters
CMRNet
Code for "CMRNet: Camera to LiDAR-Map Registration" (ITSC 2019) - WIP
Stars: ✭ 70 (+141.38%)
Mutual labels:  localization, sensor-fusion
sensor-fusion
Filters: KF, EKF, UKF || Process Models: CV, CTRV || Measurement Models: Radar, Lidar
Stars: ✭ 96 (+231.03%)
Mutual labels:  unscented-kalman-filter, sensor-fusion
parallel-non-linear-gaussian-smoothers
Companion code in JAX for the paper Parallel Iterated Extended and Sigma-Point Kalman Smoothers.
Stars: ✭ 17 (-41.38%)
Mutual labels:  unscented-kalman-filter, extended-kalman-filters
Uselfdrivingsimulator
Self-Driving Car Simulator
Stars: ✭ 48 (+65.52%)
Mutual labels:  udacity, autonomous-vehicles
self-driving-car-nd
Udacity's Self-Driving Car Nanodegree project files and notes.
Stars: ✭ 50 (+72.41%)
Mutual labels:  udacity, sensor-fusion
mpc
A software pipeline using the Model Predictive Control method to drive a car around a virtual track.
Stars: ✭ 119 (+310.34%)
Mutual labels:  udacity, model-predictive-control
Pythonrobotics
Python sample codes for robotics algorithms.
Stars: ✭ 13,934 (+47948.28%)
Mutual labels:  localization, autonomous-vehicles
go-estimate
State estimation and filtering algorithms in Go
Stars: ✭ 98 (+237.93%)
Mutual labels:  unscented-kalman-filter, sensor-fusion
UrbanLoco
UrbanLoco: A Full Sensor Suite Dataset for Mapping and Localization in Urban Scenes
Stars: ✭ 147 (+406.9%)
Mutual labels:  localization, autonomous-vehicles
Error-State-Extended-Kalman-Filter
Vehicle State Estimation using Error-State Extended Kalman Filter
Stars: ✭ 100 (+244.83%)
Mutual labels:  autonomous-vehicles, sensor-fusion

Self Driving Car NanoDegree by Udacity

This repository contains code and writeups for projects and labs completed as a part of UDACITY's first of it's kind self driving car nanodegree program.

The program is 9 months long and has three terms in total with individual terms focussing on:

  1. Computer Vision and Deep Learning - Completed

  2. Sensor Fusion, Localization and Control - Completed

  3. Path Planning and System Integration - Completed

Each of terms has comprehensive projects to ensure percolation of presented concepts. The repository is organized according to individual terms and corresponding projects/labs are contained within the subdirectories.

The course completion certificate can be found here.

List of Projects

Term 1 - Computer Vision and Deep Learning Term 2 - Sensor Fusion, Localization and Control Term 3 - Path Planning and System Integration
Finding Lane Lines Extended Kalman Filter Path Planning
Traffic Sign Classifier Unscented Kalman Filter Semantic Segmentation
Behavioral Cloning Particle Filter System Integration
Advanced Lane Lines PID Controller ---
Vehicle Detection and Tracking Model Predictive Controller ---

Disclaimer: Current students please avoid plagiarizing the code as it results in violation of Udacity's honor code.

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].