NekSfyris
Senior Robotics Engineer - making autonomous aerial/ground robots.
UK Atomic Energy AuthorityAbu Dhabi, UAE
Pinned Repositories
EKF_Lidar_Odometry
Sensor fusion between Odometry and Lidar data using an Extended Kalman Filter.
ESEKF_IMU_GNSS_Lidar
Sensor fusion between IMU, GNSS and Lidar data using an Error State Extended Kalman Filter.
fbow_ros
Fast-bag-of-words ROS wrapper for feature-based place detection and relocalization.
Monocular_Visual_Odometry
Camera trajectory estimation using feature-based Visual Odometry from a monocular camera.
Motion_Planning_CARLA
An implementation of a full motion and behavior planning pipeline for a self-driving car in the CARLA simulator.
Nao-Keyboard-Teleoperation
A ROS-based package implementation for Nao v5 robot teleoperation using the keyboard in C++.
occupancy_grid_mapping_2DLidar
Occupancy grid mapping based on 2D Lidar data assuming perfect knowledge of a robot's trajectory.
PythonRobotics
Python sample codes for robotics algorithms.
Road-and-Lane-Estimation
3D Drivable space and Lane estimation from semantic segmentation with distance to target detection.
weeding_bot
A weeding robot that can autonomously navigate in the field between obstacles, identify different kinds of weeds and then spray them in a Gazebo simulation environment.
NekSfyris's Repositories
NekSfyris/ESEKF_IMU_GNSS_Lidar
Sensor fusion between IMU, GNSS and Lidar data using an Error State Extended Kalman Filter.
NekSfyris/Motion_Planning_CARLA
An implementation of a full motion and behavior planning pipeline for a self-driving car in the CARLA simulator.
NekSfyris/EKF_Lidar_Odometry
Sensor fusion between Odometry and Lidar data using an Extended Kalman Filter.
NekSfyris/Monocular_Visual_Odometry
Camera trajectory estimation using feature-based Visual Odometry from a monocular camera.
NekSfyris/occupancy_grid_mapping_2DLidar
Occupancy grid mapping based on 2D Lidar data assuming perfect knowledge of a robot's trajectory.
NekSfyris/weeding_bot
A weeding robot that can autonomously navigate in the field between obstacles, identify different kinds of weeds and then spray them in a Gazebo simulation environment.
NekSfyris/fbow_ros
Fast-bag-of-words ROS wrapper for feature-based place detection and relocalization.
NekSfyris/PythonRobotics
Python sample codes for robotics algorithms.
NekSfyris/Nao-Keyboard-Teleoperation
A ROS-based package implementation for Nao v5 robot teleoperation using the keyboard in C++.
NekSfyris/Road-and-Lane-Estimation
3D Drivable space and Lane estimation from semantic segmentation with distance to target detection.
NekSfyris/Simulated-Annealing-Min-Conflicts_N_Queens
Implementation of the N-Queens problem by using Simulated Annealing as a local search algorithm and Min Conflicts as the CSP (Constraint Satisfaction Problem) algorithm.
NekSfyris/dso
Direct Sparse Odometry
NekSfyris/video_to_rosbag
A ROS package that takes as input a video file and makes it a rosbag.
NekSfyris/astar_path_planning
A simple and interactive platform to test A* path planning.
NekSfyris/backtrader
Python Backtesting library for trading strategies
NekSfyris/Cpp-Test-Cases
Multiple problems solved using OOP and the C++ STL. Problems are mostly from LeetCode.
NekSfyris/depth_first_search
An implementation of the depth first search algorithm to find the optimal path in a graph. The graph contains information about the streets that a person has to cross, with weights and a low-high traffic value, while he is aiming to reach his destination as soon as possible.
NekSfyris/Firmware
PX4 Autopilot Software
NekSfyris/LCSD_SLAM
NekSfyris/mrpt
:zap: The Mobile Robot Programming Toolkit (MRPT)
NekSfyris/Nao-Field-Limits-Recognition
Nao recognises field limits and moves freely in a given space. ROS-OpenCV
NekSfyris/Nao-Sonar-Mapping
A ROS based package implementation for Nao v5 robot to create a polar map of its surroundings using its sonars in C++.
NekSfyris/opencv-python-blueprints
M. Beyeler (2015). OpenCV with Python Blueprints: Design and develop advanced computer vision projects using OpenCV with Python, Packt Publishing Ltd., ISBN 978-178528269-0.
NekSfyris/OpenMP-pthreads_Hamming
Acceleration of Hamming Distance between strings of integers using OpenMP Application Protocol Interface (API) and POSIX threads standard.
NekSfyris/ORB_SLAM2
Real-Time SLAM for Monocular, Stereo and RGB-D Cameras, with Loop Detection and Relocalization Capabilities
NekSfyris/python-examples-cv
OpenCV Python Computer Vision Examples used for Teaching
NekSfyris/recursive_least_squares
Least squares and recursive least squares implementation. 2D line fit to noisy data.
NekSfyris/ros2_node_templates
Templates for subscriber/publisher nodes in ROS2 Humble.
NekSfyris/ros_to_ros2_talk_examples
NekSfyris/SSE-MPI_omega_statistic
Acceleration of omega statistic calculation using Streaming SIMD Extensions (SSE) and MPI (Message Passing Interface).