Pinned Repositories
6DOF_Quadcopter_LQR_Trajectory_Following
6DOF_Quadcopter_MPC
Trajectory tracking of a 6 dof quadcopter using model predictive control in Python
cpp_RRT
A simple C++ implementation of the RRT path planning algorithm
Kalman-Filter-2D-Tracking
Tracking a planar vehicle with 4 states (x, y, vx, vy) using simulated sensor readings and a kalman filter in Python
Max-Orbit-Transfer
Turn optimal trajectory problem into two point boundary value problem, and solving it is using indirect shooting method in scipy
MPC_Inverted_Pendulum
Simulated Model Predictive Controller (MPC) for an inverted pendulum on a cart in Python
Rocket-Land-Neural-Network
Train a neural network to find optimal trajectory for landing a mass-varying rocket upright on the ground
ROS-Scan-Matching-Lidar
ROS node that uses ICP to match successive lidar scans for position and orientation estimates
ROS_Waypoint_Follower
Rospy node that creates a spline path from user-specified waypoints, and commands a turtlebot to follow it using a nonlinear kinematic controller
SpaceCraft-Attitude-Control-LQR
A C++ implementation of a Linear Quadratic Regulator (LQR) for optimal stabilization of a satellite attitude and angular rates.
TylerReimer13's Repositories
TylerReimer13/6DOF_Quadcopter_MPC
Trajectory tracking of a 6 dof quadcopter using model predictive control in Python
TylerReimer13/MPC_Inverted_Pendulum
Simulated Model Predictive Controller (MPC) for an inverted pendulum on a cart in Python
TylerReimer13/SpaceCraft-Attitude-Control-LQR
A C++ implementation of a Linear Quadratic Regulator (LQR) for optimal stabilization of a satellite attitude and angular rates.
TylerReimer13/Kalman-Filter-2D-Tracking
Tracking a planar vehicle with 4 states (x, y, vx, vy) using simulated sensor readings and a kalman filter in Python
TylerReimer13/6DOF_Quadcopter_LQR_Trajectory_Following
TylerReimer13/cpp_RRT
A simple C++ implementation of the RRT path planning algorithm
TylerReimer13/Max-Orbit-Transfer
Turn optimal trajectory problem into two point boundary value problem, and solving it is using indirect shooting method in scipy
TylerReimer13/Rocket-Land-Neural-Network
Train a neural network to find optimal trajectory for landing a mass-varying rocket upright on the ground
TylerReimer13/ROS-Scan-Matching-Lidar
ROS node that uses ICP to match successive lidar scans for position and orientation estimates
TylerReimer13/ROS_Path_Planning
C++ path planning algorithms simulated and visualized with ROS/Rviz
TylerReimer13/ROS_Waypoint_Follower
Rospy node that creates a spline path from user-specified waypoints, and commands a turtlebot to follow it using a nonlinear kinematic controller
TylerReimer13/2D-Missile-Intercept
Python implementation of proportional navigation guidance for a 2D interceptor and non-maneuvering target.
TylerReimer13/cpp_LIDAR_mapping
Convert laser range scanner raw data into an occupancy grid with C++ and OpenCV
TylerReimer13/LQR_Control_Inv_Pendulum
Python simulation of an inverted pendulum. Uses an LQR controller to track reference angle commands.
TylerReimer13/Nonlinear_Kinematic_Controller_WMR
A nonlinear kinematic controller for a differential drive mobile robot using the Lyapunov Direct Method
TylerReimer13/OpenCV-Lane-Detection
TylerReimer13/ParticleFilter_cpp
C++ Particle Filter implementation for mobile robot navigation in GPS denied environment (using landmarks)
TylerReimer13/A2C_RL_CartPole
An implementation of the n-step Advantage Actor Critic (A2C) Reinforcement Learning algorithm to solve the open-ai CartPole environment
TylerReimer13/AStar-cpp
Cleaner, faster, and more efficient implementation of the A Star Path Planning Algorithm in C++
TylerReimer13/CPP-Reinforcement-Learning
TylerReimer13/EKF-SLAM
A Python implementation of Extended Kalman Filter SLAM for a 2-D differential drive mobile robot
TylerReimer13/Lidar-Scan-Matching
Matching real lidar point clouds using ICP (Iterative Closest Point Algorithm) in Python
TylerReimer13/Lunar-Lander-Optimal-Landing
Python simulation of a mass-varying lunar lander that plots a trajectory to minimize control effort (customizable)
TylerReimer13/OpenCV_color_tracking
C++ OpenCV implementation of color tracking using multiple filters to remove noise
TylerReimer13/Particle-Swarm-Optimization
Particle Swarm Optimization (PSO) algorithm in Python
TylerReimer13/Python-Computer-Vision
Some computer vision algorithms impemented from scratch in Python
TylerReimer13/Q_Learning_GridWorld
Reinforcement Learning Agent designed to find the goal square in the least amount of steps possible. Number of cells in the grid world, as well as start and end locations, are user specified.
TylerReimer13/Spacecraft_Orbit_Sim
2-D simulation of orbital trajectories starting on Earth's surface
TylerReimer13/Strips-AI-VideoGame-NPC
A STRIPS style planning algorithm for the high level decision making of an npc
TylerReimer13/Trajectory-Optimization-Pendulum-Swingup
Python implementation of trajectory optimization for swinging up an inverted pendulum.