Pinned Repositories
adaptive_low_pass_filter
low pass filter arduino library based on the low pass filter tutorial by Curio Res
arduino_matrix_vector_lab
arrow_key_teleop_drive
ros2 package to help you drive your robot similar to the teleop drive but with arrowkeys
imu_madgwick_filter
madgwick filter arduino library based on the imu_tool madgwick code by CCNYRoboticsLab
mobo_bot
A differential drive robot I designed with pure urdf (i.e no meshes) to learn different navigation concepts in ros2
move_to_goal
path tracking algorithm from the PythonRobotic codes adapted for ROS2
navigation2_ignition_gazebo_example
Minimal example for using Navigation 2 with (Ignition) Gazebo
robo_car
This is a four wheel drive ackermann steer robot built in ROS2
rover_bot
this is a six drive wheel robot with a rocker-bogie mechanism built with pure urdf and no meshes. It has it own drive controller and can climb rough uneven terrain easily
serial_comm_pyserial_and_arduino
sample serial communication code between pyserial and arduino that can be adapted to any project.
samuko-things's Repositories
samuko-things/serial
Cross-platform, Serial Port library written in C++
samuko-things/python-engineer-notebooks
samuko-things/new_ros1_keyboard_teleop
samuko-things/mbot_ros1_noetic
mobile robot project built on ros noetic
samuko-things/Madgwick_Filter
A quaternion based sensor fusion algorithm that fuses accelerometers and gyroscopes and optionally magnetometers
samuko-things/ArduinoTutorials
samuko-things/ubr_reloaded
Updated packages for the UBR-1
samuko-things/The-C-20-Masterclass-Source-Code
Source code for the C++ 20 Masterclass on udemy
samuko-things/matplotlib-cpp
Extremely simple yet powerful header-only C++ plotting library built on the popular matplotlib
samuko-things/Probabilistic-Robotics-Algorithms
Python implementations of state estimation and SLAM algorithms in Probabilistic Robotics.
samuko-things/cpp_matrix_library_2
samuko-things/cpp_matrix_library_1
samuko-things/RTIMULib
RTIMULib is a C++ and Python library that makes it easy to use 9-dof and 10-dof IMUs with embedded Linux systems (especially the Raspberry PI and Intel Edison!)
samuko-things/madgwick_py
A Python implementation of Madgwick's IMU and AHRS algorithm.
samuko-things/PythonRobotics
Python sample codes for robotics algorithms.
samuko-things/Kalman-and-Bayesian-Filters-in-Python
Kalman Filter book using Jupyter Notebook. Focuses on building intuition and experience, not formal proofs. Includes Kalman filters,extended Kalman filters, unscented Kalman filters, particle filters, and more. All exercises include solutions.
samuko-things/Udacity--Self-Driving-Car-Nanodegree
samuko-things/DeepPiCar
Deep Learning Autonomous Car based on Raspberry Pi, SunFounder PiCar-V Kit, TensorFlow, and Google's EdgeTPU Co-Processor
samuko-things/HSV-Color-Picker
A simple OpenCV script that displays the upper and lower HSV ranges of any pixel in an RGB image
samuko-things/A-STAR-search-algorithm-implemented-in-ROS
A* is a computer algorithm that is widely used in pathfinding and graph traversal, which is the process of finding a path between multiple points, called "nodes". It enjoys widespread use due to its performance and accuracy. However, in practical travel-routing systems, it is generally outperformed by algorithms which can pre-process the graph to attain better performance, although other work has found A* to be superior to other approaches.
samuko-things/Arduino
samuko-things/i2c_imu
ROS node for communicating with several models of commercially available IMUs over I2C in linux.
samuko-things/LSM9DS0
3D Accelerometer 3D Gyroscope 3D Magnetometer
samuko-things/ubr1_preview
Preview Repository for UBR-1, including Gazebo