Zhu-w's Stars
Dangko/ego-planner-for-ground-robot
jizhang-cmu/ground_based_autonomy_basic
Autonomous Navigation and Collision Avoidance for Ground Robots
luoshi006/py_planning
jgoppert/fixedwing_gazebo
Gazebo fixedwing models.
webvenky/simple-airplane
A simple ROS-Gazebo package provides a quick headstart for testing high level path planning / visual servoing algorithms on multiple fixed-wing unmanned aerial vehicles.
StanfordASL/asl_fixedwing
Fixed Wing Aircraft Control
ethz-asl/terrain-navigation
Implementation for safe low altitude navigation in steep terrain for fixed-wing Aerial Vehicles
lee-shun/fixed_wing_formation_control
Fixed-Wing UAV Formation Controller Design and Implementation
SYSU-STAR/CICRSIM
UAV Simulator for CICR2023
yuwei-wu/RoboPhD
Some records and notes of weekly arXiv papers, GRASP seminars, and resources
siyuanwu99/traj_opt
Trajectory generation and optimization
siyuanwu99/dynamic_map_generator
ntu-caokun/DIRECT
a solver-free polynomial trajectory generation framework
ZJU-FAST-Lab/Dftpav
A lightweight differential flatness-based trajectory planner for car-like robots
hanruihua/GenerateCurveTool
A tool of generating the common curves for the robot path planning, including dubins path, reeds shepp, etc.
castacks/trochoids
Time-optimal path planning for UAVs in wind using trochoids and Dubins set classification. Package also includes a fast Dubins path solver in no-wind scenarios.
srnand/Mobile-Robots-Autonomous-Navigation
Implemented Dubin's Curves and Rapidly Exploring Random Trees and RRT Star with branches as Dubin's Curves for path planning in Python and also simulated in Gazebo using ROS.
SASLabStevens/MASC-Architecture
This projects addresses unmanned aerial vehicle (UAV) navigation and path planning under engine-out case for landing under severe weather using a Multi-Level Adaptation approach. This is a milestone in a novel autopilot framework, which enables a UAV under large uncertainties to perform safety maneuvers that are traditionally reserved for human pilots with sufficient experience. In addition, we present a high-fidelity simulation environment for fixed-wing aircraft to test and validate the approach under various uncertainties. For the proposed Multi-Level Adaptation autopilot framework, we present the design and analysis as well as the simulation results for the case of emergency landing due to engine failure under severe weather conditions, a challenging task for an autonomous aircraft.
SimonsRoad/FixedWingUAV
RRT algorithm implemented in a 6DOF Model
olwyk/FYP2019
FYP on path planning for swarming fixed-wing aircraft using distributed model predictive control . Written in MATLAB using IPOPT.
chengji253/Multiple-fixed-wing-UAVs-flight-simulation-platform
A multiple fixed-wing UAVs flight simulation platform built by matlab and simulink.
ZJU-FAST-Lab/GPA-Teleoperation
HKUST-Aerial-Robotics/AutoTrans
AutoTrans: A Complete Planning and Control Framework for Autonomous UAV Payload Transportation.
sikang/motion_primitive_library
Search-based motion planning for differential flat systems
GPrathap/motion_planning
ZJU-FAST-Lab/large_scale_traj_optimizer
Fast (Fastest?) Minimum Snap Trajectory Generation with Analytical Gradient
moribots/motion_planning
Motion Planning Library to accompany turtlebot3_from_scratch repository. Deployed PRM, Grid Map, A*, Theta*, LPA*, D* Lite*, Potential Field, and MPPI.
ai-winter/python_motion_planning
Motion planning and Navigation of AGV/AMR:python implementation of Dijkstra, A*, JPS, D*, LPA*, D* Lite, (Lazy)Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, Voronoi, PID, DWA, APF, LQR, MPC, RPP, DDPG, Bezier, Dubins etc.
ZamesNg/kinodynamic_frontend
kinodynamic RRT* & A*
ethz-asl/mav_voxblox_planning
MAV planning tools using voxblox as the map representation.