Pinned Repositories
2D_Lidar_Slam
2D激光SLAM学习代码(深蓝激光slam大作业)
3d_navigation
Global and local path planner plugins for ROS move_base which move the robot in 2D (x,y,angle) but avoid collisions using full 3D data (robot meshes and environment octomap).
agv_local_planner
A Novel Online Time-Optimal Kinodynamic Motion Planning for ROS local planner plugin Using NURBS
ai_local_planner
AI Local Planning for ROS
Alpha
amcl_noted
amcl代码注释
amcl_pose_updater
This is modified version of amcl ros package. We added amcl pose updater that updates amcl_pose and the particle states when known-pose flag is detected.
AR-localization
ROS package to autonomously localize a robot using AR markers
arips_local_planner
ROS local planner navigation plugin using potential fields
study_shenlan
the annotation of shenlan
pangxiansen123's Repositories
pangxiansen123/ai_local_planner
AI Local Planning for ROS
pangxiansen123/AR-localization
ROS package to autonomously localize a robot using AR markers
pangxiansen123/costmap_prohibition_layer
ROS-Package that implements a costmap layer to add prohibited areas to the costmap-2D by a user configuration.
pangxiansen123/egoTEB
Perception space planning using timed-elastic-bands
pangxiansen123/hi_amcl3d
pangxiansen123/hypharos_minicar
1/20 MiniCar: An ackermann based rover for MPC and Pure-Pursuit controller
pangxiansen123/IYDC_orbslam2
带定位和保存地图的orbslam
pangxiansen123/LeGO-LOAM_NOTED
LeGO-LOAM代码注释与学习
pangxiansen123/LOAM_NOTED
loam code noted in Chinese(loam中文注解版)
pangxiansen123/LocalizationUnscentedKalmanFilter
Demo: Determine the location of a vehicle based on the unscented Kalman filter algorithm
pangxiansen123/motion_planning
Motion Planning Library to accompany turtlebot3_from_scratch repository. Deployed PRM, Grid Map, A*, Theta*, LPA*, D* Lite*, Potential Field, and MPPI.
pangxiansen123/mpc_local_planner_mb
MPC Local Planner Plugin for move_base, ROS melodic.
pangxiansen123/navigation
ROS Navigation stack. Code for finding where the robot is and how it can get somewhere else.
pangxiansen123/neato_global_planner
This repository contains code to link published waypoints to the move_base_local_planner. By this, we don't rely on move_base's global planner and can execute custom waypoint following.
pangxiansen123/Obstacle_Avoidance_MPC_Controller_A_star_Planning
Final project for "Control systems for robotics" - simulation of obstacle avoidance on an autonomous car using MPC
pangxiansen123/orocos-bayesian-filtering
The orocos Bayesian Filtering Library
pangxiansen123/person_local_planner
a person zone predicted based local path planner
pangxiansen123/pipeline_planner_open
global planner which restricts a robot in a pipeline
pangxiansen123/Position-Tracker
Tracks position of a vehicle by fusing data obtained from an MPU9250 and an optical displacement sensor using Kalman Filter.
pangxiansen123/PythonRobotics
Python sample codes for robotics algorithms.
pangxiansen123/Reinforce
Reinforcement Learning Algorithm Package & PuckWorld, GridWorld Gym environments
pangxiansen123/reinforcement_learning_code_explanation
explanation of the sutton's code
pangxiansen123/roadmap_global_planner
pangxiansen123/segment_global_planner
A ROS global planner plugin for segments tracking
pangxiansen123/simple_local_planner-add-eband
pangxiansen123/Solving-TSP-VRP
A MATLAB Implementation of Heuristic Algorithms to Traveling Salesman Problem and Vehicle Routing Problems.
pangxiansen123/State-Estimation-using-ES-EKF
Vehicle State Estimation using Error State Extended Kalman Filter with (IMU, LIDAR and GNSS) sensors data
pangxiansen123/uwb-localization
Accurate 3D Localization for MAV Swarms by UWB and IMU Fusion.
pangxiansen123/voronoi_planner
ROS navigation stack base global planner plugin
pangxiansen123/waypoint-global-planner
A global planner that generates a path using manually inserted waypoints. Compatible with move_base.