nirajbasnet
Full time learner! Roboticist. Interested in Motion planning and Controls.
1500 Laurel Street
Pinned Repositories
360video_stitching
Implementation of 360 degree video stitching from multiple cameras using opencv.
Autonomous_wheelchair_navigation
use of probabilistic algorithms in a differential drive robot for totally autonomous navigation in indoor environment.
dynamics_modeling_of_self_driving_car
Modelling the dynamics of F1/10 car and learning to track a trajectory in a given environment
Motion-planning-in-city-traffic-using-Carla
Implementation of FSM based behavior planner and also conformal lattice planner to generate trajectory set for getting feasible motion plan in city traffic.
Nonlinear_MPCC_for_autonomous_racing
Nonlinear MPCC for autonomous driving of F1/10 cars
OSM_Route_Planner
Route planning in any given Open Street map using Astar search
RRTstar-motion-planner-with-minimum-jerk-for-quadrotor
Quadrotor path planning using various sampling strategies on top of Informed RRT*.
Sensor_fusion_IMU_MPU6050
Implementation of both Kalman filter and second order complimentary filter for accelerometer and gyroscope data fusion.
Unscented-Kalman-Filter-for-Tracking-Moving-Objects
Implementation of UKF for tracking moving objects(pedestrians, cars)
Warehouse_Task_Allocation
Using coevolutionary algorithms for efficient task allocation in warehouse domain.
nirajbasnet's Repositories
nirajbasnet/Nonlinear_MPCC_for_autonomous_racing
Nonlinear MPCC for autonomous driving of F1/10 cars
nirajbasnet/Motion-planning-in-city-traffic-using-Carla
Implementation of FSM based behavior planner and also conformal lattice planner to generate trajectory set for getting feasible motion plan in city traffic.
nirajbasnet/RRTstar-motion-planner-with-minimum-jerk-for-quadrotor
Quadrotor path planning using various sampling strategies on top of Informed RRT*.
nirajbasnet/360video_stitching
Implementation of 360 degree video stitching from multiple cameras using opencv.
nirajbasnet/Sensor_fusion_IMU_MPU6050
Implementation of both Kalman filter and second order complimentary filter for accelerometer and gyroscope data fusion.
nirajbasnet/dynamics_modeling_of_self_driving_car
Modelling the dynamics of F1/10 car and learning to track a trajectory in a given environment
nirajbasnet/Warehouse_Task_Allocation
Using coevolutionary algorithms for efficient task allocation in warehouse domain.
nirajbasnet/2d_Occupancy_Grid_mapping
nirajbasnet/Autonomous_wheelchair_navigation
use of probabilistic algorithms in a differential drive robot for totally autonomous navigation in indoor environment.
nirajbasnet/f1tenth_gtc_tutorial
Instructor led training for F1/10 Autonomous Racing
nirajbasnet/Graph-Search-Based-Planners
Implementation of popular graph search-based planning algorithms.
nirajbasnet/mcl
Implementation of Monte carlo localization(Particle filter) package for ROS from scratch.
nirajbasnet/multi_agent_path_planning
This repository consists of the Python implementation of a few multi-robot path-planning algorithms.
nirajbasnet/OSM_Route_Planner
Route planning in any given Open Street map using Astar search
nirajbasnet/pure_pursuit_tracker
Implementation of Pure Pursuit path tracking algorithm on F1/10 cars.
nirajbasnet/rotors_simulator
RotorS is a UAV gazebo simulator
nirajbasnet/Unscented-Kalman-Filter-for-Tracking-Moving-Objects
Implementation of UKF for tracking moving objects(pedestrians, cars)
nirajbasnet/velocity_optimization
Optimizes (Maximizes) the velocity profile for a vehicle with respect to physical constraints (e.g., power, force, combined acceleration, ...). Takes into account a variable friction potential between road and tires. Max. power input can be variable (for e.g., energy strategy purpose).
nirajbasnet/3d_Model_Renderer
A program written from scratch without using opengl and such graphics libraries to load any object models and view them by desired transformations
nirajbasnet/cocp
Source code for the examples accompanying the paper "Learning convex optimization control policies."
nirajbasnet/Deep_neural_network_image_classifier_without_cnn
nirajbasnet/f1tenth_docker
nirajbasnet/GraphBasedLocalTrajectoryPlanner
Local trajectory planner based on a multilayer graph framework for autonomous race vehicles.
nirajbasnet/Inverted_Pendulum
AVR microcontroller source code for self balancing robot on two wheels
nirajbasnet/mav_trajectory_generation
Polynomial trajectory generation and optimization, especially for rotary-wing MAVs.
nirajbasnet/Obstacle-detection-on-Highway-using-LiDAR-SNFD-Project
nirajbasnet/Planar_data_classification_with_neural_network
nirajbasnet/Qlearning_gridworld
Use of qlearning to solve target tracking by an agent in gridworld
nirajbasnet/Simple_logistic_regression_implementation
Implementation of simple logistic regression image classifier with a single layer neural network
nirajbasnet/tacotron2
Tacotron 2 - PyTorch implementation with faster-than-realtime inference