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

GitHub topics: extended-kalman-filter

baggepinnen/LowLevelParticleFilters.jl

State estimation, smoothing and parameter estimation using Kalman and particle filters.

Language: Julia - Size: 332 MB - Last synced at: 6 days ago - Pushed at: 6 days ago - Stars: 127 - Forks: 17

dnblvr/robot_navigation_project

an Autonomous Navigator implemented on the TI-RSLK MAX Chassis, by Lucero Aguilar-Larios and Gian Fajardo

Language: C - Size: 1.1 MB - Last synced at: 9 days ago - Pushed at: 9 days ago - Stars: 0 - Forks: 0

ymorsi7/Visual-Intertial-SLAM

Visual-Inertial SLAM with EKF and feature detection for robot mapping and localization.

Language: Jupyter Notebook - Size: 12 MB - Last synced at: 13 days ago - Pushed at: 13 days ago - Stars: 1 - Forks: 0

yishaiSilver/aruco-slam

Using visual markers, Extended Kalman Filters, Factor Graphs, etc. to localize a handheld camera.

Language: Python - Size: 201 MB - Last synced at: 13 days ago - Pushed at: 14 days ago - Stars: 9 - Forks: 2

anna-kay/SLAM-Extended-Kalman-Filter-Particle-Filter

SLAM (Simultaneous Localization and Mapping): Position estimation of vehicle and obstacles with Extended-Kalman and Particle filters in Matlab, using the System Identification Toolbox.

Language: MATLAB - Size: 102 KB - Last synced at: 20 days ago - Pushed at: 20 days ago - Stars: 9 - Forks: 0

lmqZach/Visual-Inertial-SLAM

Implement an Extended Kalman Filter to track the three dimensional position and orientation of a robot using gyroscope, accelerometer, and camera measurements.

Language: Python - Size: 6.15 MB - Last synced at: 21 days ago - Pushed at: 21 days ago - Stars: 11 - Forks: 4

AlexanderSobolev1990/kalman_filters_solution

Kalman filters - linear and nonlinear (unscented, cubature, square root and hybride versions)

Language: C++ - Size: 2.84 MB - Last synced at: 21 days ago - Pushed at: 3 months ago - Stars: 15 - Forks: 0

TUMFTM/3DVehicleDynamicsStateEstimation

3D-PointMass-EKF for State Estimation coupled with STM-UKF for Side Slip Angle Estimation

Language: C++ - Size: 10.8 MB - Last synced at: 27 days ago - Pushed at: 9 months ago - Stars: 51 - Forks: 9

milosgajdos/go-estimate

State estimation and filtering algorithms in Go

Language: Go - Size: 873 KB - Last synced at: about 1 month ago - Pushed at: 4 months ago - Stars: 116 - Forks: 8

ethz-adrl/control-toolbox

The Control Toolbox - An Open-Source C++ Library for Robotics, Optimal and Model Predictive Control

Language: C++ - Size: 13.7 MB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 1,541 - Forks: 327

AndreiMoraru123/2D-Tracker

Linear, Extended & Unscented Kalman filter Fusion Models for 2D tracking

Language: MATLAB - Size: 584 KB - Last synced at: 6 days ago - Pushed at: about 2 years ago - Stars: 8 - Forks: 2

collabora/cnkalman 📦

This is a relatively low level implementation of a kalman filter; with support for extended and iterative extended kalman filters. The goals of the project are to provide a numerically stable, robust EKF implementation which is both fast and portable.

Language: C - Size: 151 KB - Last synced at: 1 day ago - Pushed at: about 2 months ago - Stars: 21 - Forks: 14

ehong-tl/PyKalmanFilterVariants

KF, EKF and UKF in Python

Language: Python - Size: 15.6 KB - Last synced at: 28 days ago - Pushed at: over 6 years ago - Stars: 8 - Forks: 2

zhaoqj23/FE-GUT

A novel architecture in which the Factor Graph Optimization (FGO) is hybrid with the Extended Kalman Filter (EKF) for tightly coupled GNSS/UWB integration with online Temporal calibration (FE-GUT).

Language: C++ - Size: 26.6 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 63 - Forks: 7

marcotallone/mpc-tracking

Implementation of a non-linear Model Predictive Control (MPC) algorithm for reference traking with the addition of an Extended Kalman Filter (EKF) for state estimation and robustness to noise.

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

Xylambda/kalmankit

Multidimensional implementation of standard and extended Kalman Filters

Language: Python - Size: 3.13 MB - Last synced at: 24 days ago - Pushed at: 9 months ago - Stars: 18 - Forks: 5

pockerman/qubic_engine

Collection of C++ based algorithms on numerics, statistics, control, reinforcement learning, machine learning and robotics

Language: C++ - Size: 9.96 MB - Last synced at: 29 days ago - Pushed at: over 3 years ago - Stars: 10 - Forks: 1

DanielMartensson/Unscented-Kalman-Filter

Unscented Kalman Filter in C code and MATLAB code - Easy to use

Size: 1.97 MB - Last synced at: 10 days ago - Pushed at: over 2 years ago - Stars: 26 - Forks: 9

NieRNiu/Orientation-estimation-using-smart-phone-sensors

Repository for Chalmers course SSY345

Language: MATLAB - Size: 5.85 MB - Last synced at: 28 days ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

pekkaran/violet

A toy stereo visual inertial odometry (VIO) system

Language: Rust - Size: 328 KB - Last synced at: 4 months ago - Pushed at: about 2 years ago - Stars: 10 - Forks: 3

Pippo98/kflib

Kalman Filter implementations in C++

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

GianniCassoni/EKF

Extended kalman filter

Language: MATLAB - Size: 8.79 KB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 0 - Forks: 0

natsnyder1/CauchyFriendly

multivariate cauchy estimator - a new and robust bayesian state estimation algorithm

Language: Jupyter Notebook - Size: 34 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 3 - Forks: 0

gavincangan/bayesian-robotics

Fuse camera and LIDAR sensor data to track an object using an Extended Kalman Filter and performed SLAM

Language: Python - Size: 556 KB - Last synced at: 5 days ago - Pushed at: about 6 years ago - Stars: 17 - Forks: 5

milosgajdos/go-estimate-examples

Examples of usage for go-estimate

Language: Go - Size: 287 KB - Last synced at: 18 days ago - Pushed at: about 2 years ago - Stars: 7 - Forks: 2

EEA-sensors/sqrt-parallel-smoothers

A generic library for linear and non-linear Gaussian smoothing problems. The code leverages JAX and implements several linearization algorithms, both in a sequential and parallel fashion, as well as efficient gradient rules for computing gradients of required quantities (such as the pseudo-loglikelihood of the system).

Language: Jupyter Notebook - Size: 68.9 MB - Last synced at: 6 months ago - Pushed at: 10 months ago - Stars: 12 - Forks: 3

Bulbatronik/AGV-Localization-and-Bayesian-Tracking

Repo containing labs and final project files for "Localization, Navigation and Smart Mobility" course taken during academic year 2021-2022 summer semester of Master of Telecommunication Engineering program at Politecnico di Milano.

Language: MATLAB - Size: 7.94 MB - Last synced at: 7 months ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

spsingh37/Bayesian-filtering-and-SLAM

This is a comprehensive project focused on implementing popular algorithms for state estimation, robot localization, 2D mapping, and 2D & 3D SLAM. It utilizes various types of filters, including the Kalman Filter, Extended Kalman Filter, Unscented Kalman Filter, and Particle Filter.

Language: Jupyter Notebook - Size: 245 MB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 1 - Forks: 0

RIVeR-Lab/multiterrain-gp-model

Probabilistic Motion Modeling Algorithm for Skid Steered Mobile Robots

Language: Python - Size: 43.9 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 13 - Forks: 0

ashwathkart/kalman-filter

State estimation of a Dubin's Car using Extended Kalman Filter

Language: Python - Size: 685 KB - Last synced at: 8 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 0

jfoshea/Extended-Kalman-Filter

Utilize an Extended Kalman Filter to estimate the state of a moving object of interest with noisy Lidar and Radar measurements

Language: C++ - Size: 1.31 MB - Last synced at: 10 months ago - Pushed at: about 7 years ago - Stars: 2 - Forks: 0

miheer-diwan/Vision-Based-Localization-Using-Nonlinear-Kalman-Filters

Robust quadrotor pose estimation in 3D space with a Vision-based observation model and EKF

Language: Python - Size: 21.5 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

boennecd/dynamichazard

R package for survival analysis with state space models

Language: HTML - Size: 619 MB - Last synced at: 9 months ago - Pushed at: over 2 years ago - Stars: 9 - Forks: 3

jiangjingxue/Kalman_Filter_Variations_Library

Implementation of several popular Kalman filter nonlinear variants intended for robotics systems and vehicle state estimation, including Extended Kalman Filter, Unscented Kalman Filter, Error State EKF, Invariant EKF, Square Root EKF, Cubature KF.

Language: Python - Size: 8.36 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 2 - Forks: 1

NikolaAndro/Kalman_Filters

Different examples for applying Kalman Filers using Python.

Language: Python - Size: 120 KB - Last synced at: 12 months ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

phiyodr/CarND-Extended-Kalman-Filter-Project

Sensor Fusion - Udacity's Self Driving Car Nanodegree

Language: C++ - Size: 2.51 MB - Last synced at: 12 months ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

Al-khwarizmi-780/OpenKF

This is an open source Kalman filter C++ library based on Eigen3 library for matrix operations. The library has generic template based classes for most of Kalman filter variants including: (1) Kalman Filter, (2) Extended Kalman Filter, (3) Unscented Kalman Filter, and (4) Square-root UKF..

Language: Jupyter Notebook - Size: 6.73 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 85 - Forks: 20

msramada/linearizing-uncertainty-for-control

This code can be used to reproduce the results in our paper ``Linearizing uncertainties that matter for control: the Koopman operator in the dual control context''.

Language: Julia - Size: 15.8 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 4 - Forks: 0

saptadeb/inekf-localization Fork of team16-mobrob-w20/inekf-localization

Mobile Robotics Final Project W20

Language: TeX - Size: 31.3 MB - Last synced at: 11 months ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 0

polarbeargo/FCND-Estimation-CPP Fork of udacity/FCND-Estimation-CPP

C++ project for the FCND estimation.

Language: C++ - Size: 212 MB - Last synced at: about 1 year ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 0

marcomarasca/SDCND-Extended-Kalman-Filter

Extended Kalman Filter implementation in C++

Language: C++ - Size: 4.4 MB - Last synced at: about 1 year ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

pateljay43/CarND-Extended-Kalman-Filter-Project

Language: C++ - Size: 2.49 MB - Last synced at: about 1 year ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

mftnakrsu/AutonomousRobots-Kalman-Filter

AutonomousRobots Series

Language: Python - Size: 489 KB - Last synced at: about 1 month ago - Pushed at: over 3 years ago - Stars: 23 - Forks: 1

SeanESCA/BathHack2024

My attempt to code an extended Kalman filter in Python for Bath Hack 2024.

Language: Jupyter Notebook - Size: 102 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

ColasGael/EKF-nonholonomic-robot

Extended Kalman Filter for non-holonomic robot Simultaneous Localization and Mapping with unknown measurement noise

Language: MATLAB - Size: 1.1 MB - Last synced at: 27 days ago - Pushed at: almost 6 years ago - Stars: 4 - Forks: 2

ray-chew/data_assimilation_examples

Simple data assimilation studies

Language: Jupyter Notebook - Size: 583 KB - Last synced at: 2 months ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

FinOrr/pid-autotuner

A collection of embedded PID (Proportional – Integral – Derivative) controller tuning methods.

Language: C++ - Size: 5.86 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

Panjete/radarStateEstimator

State Estimation using Kalman Filters, EKF and solving the Data Association problem

Language: Python - Size: 33.9 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 7 - Forks: 1

Danziger/CarND-T2-P1-Extended-Kalman-Filter

🏎️ Extended Kalman Filter (EKF) Localization Project using C++ and Eigen library for the Self-Driving Car Nanodegree at Udacity

Language: C++ - Size: 2.87 MB - Last synced at: about 1 year ago - Pushed at: almost 7 years ago - Stars: 2 - Forks: 3

JBris/time-series-online-data-assimilation-experiments

Experiments for online learning and data assimilation for time series data.

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

matssteinweg/EKF-Localization-Simulator

EKF Localization Simulator - Educational Tool for EL2320 Applied Estimation at KTH Stockholm

Language: MATLAB - Size: 1.7 MB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 4 - Forks: 2

feelpp/verdandi

Generic data assimilation library

Language: C++ - Size: 1.89 MB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 1

LukasLeonardKoening/Extended-Kalman-Filter

Extended Kalman Filter for Lidar and Radar sensor fusion

Language: C++ - Size: 2.22 MB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

kwazzi-jack/kal-cal

Kalman Filter and Smoother Implementation for Radio Interferometric Gains Calibration. This library is part of the master's work by Brian Welman and serves as a 'proof-of-concept' tool for it.

Language: Python - Size: 142 MB - Last synced at: 10 days ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 1

eanil/ProbabilisticRobotics

My solutions to Thrun et al.'s Probabilistic Robotics end of chapter questions.

Language: Jupyter Notebook - Size: 456 KB - Last synced at: over 1 year ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 1

nesl/agrobot

Neural-Kalman GNSS/INS Navigation for Precision Agriculture

Language: Jupyter Notebook - Size: 159 MB - Last synced at: about 1 year ago - Pushed at: almost 2 years ago - Stars: 42 - Forks: 7

Cen-Liu/Fast-CFEAR-Radar-Odometry

Successive Pose Estimation and Beam Tracking for mmWave Vehicular Communication Systems

Language: C++ - Size: 14.2 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 9 - Forks: 1

Arcanain/gnss_imu_odom_ESKF

Self-position estimation by eskf by measuring gnss and imu

Language: C++ - Size: 162 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 34 - Forks: 9

jameseoconnor/localisation-and-tracking-algorithms

This project examines some of the popular algorithms used for localization and tracking, including the Kalman filter, Extended Kalman filter, Unscented Kalman filter and the Particle filter.

Language: MATLAB - Size: 3.24 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 9 - Forks: 0

Janudis/Extended-Kalman-Filter-GPS_IMU

Sensor Fusion of GPS and IMU with Extended Kalman Filter for Localization in Autonomous Driving

Language: C++ - Size: 23.4 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 2 - Forks: 2

cdemutiis/Extended_Kalman_Filter

Using a Kalman Filter to estimate the state of a moving object of interest with noisy Lidar and Radar measurements

Language: C++ - Size: 2.81 MB - Last synced at: over 1 year ago - Pushed at: about 7 years ago - Stars: 1 - Forks: 0

ser94mor/sensor-fusion

Filters: KF, EKF, UKF || Process Models: CV, CTRV || Measurement Models: Radar, Lidar

Language: C++ - Size: 3.9 MB - Last synced at: over 1 year ago - Pushed at: almost 6 years ago - Stars: 157 - Forks: 51

KGolemo/orientation-estimation

Filtration and Sensor Fusion final project (5.0) - Orientation estimation based on gyroscope, accelerometer and magnetometer data fused using 7-state EKF with quaternion and gyroscope biases as state variables

Language: Jupyter Notebook - Size: 1020 KB - Last synced at: over 1 year ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

RahulGoel2000/Localisation_ws

Fusion of GPS, IMU and UWB using Robot localistaion package.

Language: Makefile - Size: 45.6 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 7 - Forks: 1

lh9171338/Sensor-Fusion

Lidar-Radar传感器融合定位

Language: C++ - Size: 229 KB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 2 - Forks: 0

emreemirfidan/EKF-Attitude-Estimation

Quaternion based Extended Kalman Filter

Language: C - Size: 17.6 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

rayryeng/Udacity_Self_Driving_Car_Nanodegree

My work from the Self-Driving Car Nanodegree Program

Language: C++ - Size: 234 MB - Last synced at: over 1 year ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 4

OSUPCVLab/pedestrian-INS-with-map-matching

Taha

Language: MATLAB - Size: 94 MB - Last synced at: over 1 year ago - Pushed at: almost 6 years ago - Stars: 8 - Forks: 4

AndresGarciaEscalante/Extended-Kalman-Filter

Compare the Position of a Turtlebot simulated in a Gazebo environment with a Filtered(Extended Kalman Filter) and a Unfilered Trajectories

Language: C++ - Size: 10.8 MB - Last synced at: almost 2 years ago - Pushed at: over 5 years ago - Stars: 5 - Forks: 1

ser94mor/extended-kalman-filter

Udacity: Self-Driving Car Engineer Nanodegree | Project: Extended Kalman Filter

Language: C++ - Size: 2.25 MB - Last synced at: almost 2 years ago - Pushed at: over 7 years ago - Stars: 4 - Forks: 1

sManohar201/SLAM-Claus-Brenner-Youtube

This repository contains solution for SLAM lectures taught by Claus Brenner on YouTube.

Language: Python - Size: 1.61 MB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 6 - Forks: 0

troiwill/iros-2021-learn-sdsmm-artificial-real-data 📦

This repository accompanies an IROS 2021 submission.

Language: Python - Size: 400 MB - Last synced at: almost 2 years ago - Pushed at: about 4 years ago - Stars: 0 - Forks: 0

AdeolaJoseph/Localization-SLAM

This repo contains several implementations of localizatoin and SLAM algorithms for robot localization

Language: Python - Size: 1.28 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

DawoonJang/kalman_family_estimation_impl

CPP Implementation of Kalman Family

Language: C++ - Size: 16.6 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

rbga/Differential-Robot

The Differential Robot project is a fully autonomous robot designed to navigate around a track, avoid obstacles, and simultaneously map the surroundings. This project was developed as a course project for Autonomous Robotics at Dalhousie University.

Language: MATLAB - Size: 42 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 2 - Forks: 0

nmarks99/turtlebot3-ekf-slam

Extended Kalman Filter SLAM from scratch on the Turtlebot3 with ROS2

Language: C++ - Size: 8.03 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

NekSfyris/EKF-Lidar-Odometry

Sensor fusion between Odometry and Lidar data using an Extended Kalman Filter.

Language: Python - Size: 293 KB - Last synced at: almost 2 years ago - Pushed at: about 4 years ago - Stars: 5 - Forks: 3

pr-db/localization-using-kalman-filters

using kalman filters for the localization of a fully autonomus bot

Language: Jupyter Notebook - Size: 79.3 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 1

RajPShinde/Extended-Kalman-Filter

Extended Kalman Filter for Pose Estimation using Odometry and IMU

Language: C++ - Size: 3.51 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 1

ko3365/Nonlinear-Kalman-Filter-StateEstimation

Nonlinear Kalman Filter - Extended, Central Difference, Unscented Kalman Filter

Language: MATLAB - Size: 160 KB - Last synced at: about 2 years ago - Pushed at: almost 3 years ago - Stars: 2 - Forks: 2

pronenewbits/Embedded_EKF_Library

A compact Extended Kalman Filter (EKF) library for real time embedded system (with template for Teensy4/Arduino and STM32CubeIDE)

Language: C++ - Size: 685 KB - Last synced at: about 2 years ago - Pushed at: about 5 years ago - Stars: 60 - Forks: 18

pabaq/CarND-Extended-Kalman-Filters

Tracking an object's state based on knowledge of its system dynamics and the availability of noisy measurements.

Language: C++ - Size: 9.49 MB - Last synced at: 5 months ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 1

CoffeeKumazaki/kalman_filters

A C++ implementation of the Kalman filter and its extension, the extended Kalman filter (EKF) and the unscented Kalman filter (UKF) using Eigen.

Language: C++ - Size: 36.2 MB - Last synced at: about 2 years ago - Pushed at: about 4 years ago - Stars: 6 - Forks: 5

resuldagdanov/voyage-to-mars

Designing an interplanetary trajectory to planet Mars :full_moon:

Language: MATLAB - Size: 8.75 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 2 - Forks: 0

mannyray/KalmanFilter

Kalman filter sanctuary - including continuous-discrete extended Kalman filter. Bring additional filters here for a bigger collection.

Language: C++ - Size: 973 KB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 30 - Forks: 15

da-phil/SDC-Unscented-Kalman-Filter

Implementation of a simple 2D UKF and EKF using an CTRV kinematics model with lidar and radar measurements.

Language: Jupyter Notebook - Size: 5.91 MB - Last synced at: almost 2 years ago - Pushed at: about 7 years ago - Stars: 8 - Forks: 4

ProgrammingCow/9-axis-IMU

Implementation of a inertial messurement unit on the STM32F3DISCOVERY discovery kit

Language: C - Size: 140 KB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 2 - Forks: 0

lucarinelli/EKF_localization_python

Language: Jupyter Notebook - Size: 1.01 MB - Last synced at: over 1 year ago - Pushed at: over 6 years ago - Stars: 2 - Forks: 1

AshivDhondea/PyTrackingToolbox

A target tracking toolbox developed in Python. It aims to demonstrate how target tracking works and to serve as a testing environment for target tracking problems.

Language: Python - Size: 269 KB - Last synced at: about 2 years ago - Pushed at: over 7 years ago - Stars: 4 - Forks: 2

jagennath-hari/Kalman-Fusion-Quadrotor-State-Estimation

Implementation of different Kalman Filters to estimate the state of the quadrotor using optical flow and IMU.

Size: 40.6 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

raghuramshankar/kalman-filter-localization

Implementation of sensor fusion using Kalman Filters for localization of autonomous vehicles.

Language: Python - Size: 69.4 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 7 - Forks: 4

JasperRice/EL2320

Applied Estimation

Language: TeX - Size: 96.2 MB - Last synced at: about 2 years ago - Pushed at: about 5 years ago - Stars: 2 - Forks: 0

KushalBKusram/ExtendedKalmanFilter

Implementation of the Extended Kalman Filter in C++

Language: C++ - Size: 786 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

milinddeore/ExtendedKalmanFilter

Extended Kalman Filter in C++ and OpenCV.

Language: C++ - Size: 8.08 MB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

ken-power/SelfDrivingCarND-ExtendedKalmanFilter

Implement an Extended Kalman Filter (EKF) and use the EFK with noisy LiDAR and RADAR measurements to estimate the state of a moving object of interest.

Language: C++ - Size: 5.09 MB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 2 - Forks: 0

vickjoeobi/Kalman_Filter_GPS_IMU

This repository contains the code for both the implementation and simulation of the extended Kalman filter. If you have any questions, please open an issue.

Language: Python - Size: 1.17 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

AnuragSahu/Localization-with-Extended-Kalman-Filter

This repo contains the codes for Mobile Robotics Assignment 4 the task is Localization with the Wheel odometry and then with Extended Kalman Filter to for Improved localization.

Language: Python - Size: 16.5 MB - Last synced at: about 2 years ago - Pushed at: over 5 years ago - Stars: 2 - Forks: 0

intelligent-control-lab/MEKF_MAME

Modified Extended Kalman Filter with generalized exponential Moving Average and dynamic Multi-Epoch update strategy (MEKF_MAME)

Language: Python - Size: 1.98 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 20 - Forks: 1

krishnasandeep09/State_Estimation_And_Localization

Error state EKF using IMU, GPS and LiDAR data

Language: Jupyter Notebook - Size: 3.37 MB - Last synced at: about 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 1

armankuzembayev/ekf

Language: Jupyter Notebook - Size: 1.91 MB - Last synced at: about 2 years ago - Pushed at: almost 5 years ago - Stars: 3 - Forks: 1

Related Keywords
extended-kalman-filter 135 kalman-filter 68 sensor-fusion 28 unscented-kalman-filter 26 localization 24 ekf 22 particle-filter 20 robotics 18 lidar 18 radar 15 slam 14 self-driving-car 13 state-estimation 13 python 12 cpp 12 matlab 9 extended-kalman-filters 9 udacity-self-driving-car 9 estimation 9 kalman-filtering 8 ukf 8 c-plus-plus 7 kalman 7 tracking 6 odometry 6 udacity 6 gps 6 pose-estimation 5 control-theory 5 kalman-tracking 5 imu 5 ekf-localization 5 autonomous-vehicles 5 opencv 4 filtering 4 object-tracking 4 data-assimilation 4 ros 4 gnss 4 bayesian 4 pid-control 3 control-systems 3 cpp17 3 model-predictive-control 3 lidar-measurements 3 localisation 3 stm32 3 cplusplus 3 robot-localization 3 path-planning 3 python3 3 autonomous-driving 3 c 3 unscented-transformation 3 radar-measurements 2 automatic-differentiation 2 particle-filters 2 autonomous-navigation 2 arduino 2 embedded 2 real-time 2 bayesian-filter 2 kf 2 machine-learning 2 inertial-measurement-units 2 non-linear-dynamics 2 eigen-library 2 kalman-smoother 2 control 2 signal-processing 2 autonomous-robots 2 robotics-algorithms 2 motion-planning 2 rrt-star 2 time-series 2 slam-algorithms 2 visual-inertial-odometry 2 computer-vision 2 factor-graph 2 gtsam 2 mapping 2 inertial-sensors 2 probabilistic-robotics 2 target-tracking 2 vehicle-tracking 2 kalman-estimator 2 estimator 2 ctrv 2 stochastic-processes 2 camera 2 sigma-point-kalman-filter 2 kalmanfilter 2 dubins-path 2 cubature-kaman-filter 2 udacity-nanodegree 2 ros-kinetic 2 cuda 2 neural-network 2 ensemble-kalman-filter 2 pedestrian-tracking 1