Pinned Repositories
3DOffroad_Navigation
learning based uncertainty-aware 3D offroad navigation
AD_MPC
MPC controller for Autonomous vehicle
AHRSUsingKalmanFilter
als_ros
An advanced localization system for ROS use.
astar_planner
A global planner plugin of a grid-based A-star search algorithm for ROS navigation stack.
b-spline
B-spline interpolation
Behavior-Tree
A lightweight library of Behavior Trees Library in C++.
BehaviorTree.CPP
Behavior Trees Library in C++. Batteries included.
far_planner
Fast, Attemptable Route Planner for Navigation in Known and Unknown Environments
mobile-AGV-optimization
An implementation of the Switchable Action Dependency Graph (SADG) based optimization scheme to re-order mobile AGVs in intralogistics environments with deadlock-free and collision-avoidance guarantees.
navigationcn's Repositories
navigationcn/far_planner
Fast, Attemptable Route Planner for Navigation in Known and Unknown Environments
navigationcn/3DOffroad_Navigation
learning based uncertainty-aware 3D offroad navigation
navigationcn/AD_MPC
MPC controller for Autonomous vehicle
navigationcn/als_ros
An advanced localization system for ROS use.
navigationcn/astar_planner
A global planner plugin of a grid-based A-star search algorithm for ROS navigation stack.
navigationcn/better_astar_global_planner
The better A* global planner plugin in ROS
navigationcn/Books_Robot_SLAM_Navigation
This project is supporting code for the book of Robot SLAM Navigation Core Technology and the Actual Combat.
navigationcn/dwa_planner
ROS implementation of DWA(Dynamic Window Approach) Planner
navigationcn/Fields2Cover
Robust and efficient coverage paths for autonomous agricultural vehicles. A modular and extensible Coverage Path Planning library
navigationcn/fkie_behavior_trees
This repository contains packages for executing behavior trees in ROS.
navigationcn/full_coverage_path_planner
Full coverage path planning provides a move_base_flex plugin that can plan a path that will fully cover a given area
navigationcn/homing_local_planner
A simple, easy-to-use, and effective path tracking planner.
navigationcn/img_env
A customized grid map-based navigation simulation platform following the Gym API.
navigationcn/lattice_path_planner
A* search with motion primitives
navigationcn/lidar_odo
A local pose estimation approach based on LIO-SAM
navigationcn/local-planning-benchmark
[ICRA2021] A unified benchmark for the evaluation of mobile robot local planning approaches
navigationcn/mesh_navigation
Mesh Navigation Stack
navigationcn/move_base_flex
Move Base Flex: a backwards-compatible replacement for move_base
navigationcn/mpc_ros
Differential Wheeled Mobile Robot - Nonlinear Model Predictive Control based on ROS
navigationcn/mrca_vc
Multi-robot collision avoidance using buffered uncertainty-aware Voronoi cells
navigationcn/mrpt_navigation
ROS nodes wrapping core MRPT functionality: localization, autonomous navigation, rawlogs, etc.
navigationcn/navigation-assistant
A wrapper for move_base that can break down a global navigation goal into multiple sequential sub-goals according to multiple settings.
navigationcn/navigation_layers
navigationcn/neo_localization
Neobotix localization package, a more accurate alternative to AMCL.
navigationcn/neonavigation
A 2-D/3-DOF seamless global/local mobile robot motion planner package for ROS
navigationcn/path_planner
Hybrid A* Path Planner for the KTH Research Concept Vehicle
navigationcn/polygon_coverage_planning
Coverage planning in general polygons with holes.
navigationcn/robot_navigation
Spiritual successor to ros-planning/navigation.
navigationcn/ros_autonomous_slam
ROS package which uses the Navigation Stack to autonomously explore an unknown environment with help of GMAPPING and constructs a map of the explored environment. Finally, a path planning algorithm from the Navigation stack is used in the newly generated map to reach the goal. The Gazebo simulator is used for the simulation of the Turtlebot3 Waffle Pi robot. Various algorithms have been integrated for Autonomously exploring the region and constructing the map with help of the 360-degree Lidar sensor. Different environments can be swapped within launch files to generate a map of the environment.
navigationcn/voronoi_planner
A global planner plugin for ROS navigation stack, in which A* search on a discrete gneralized Voronoi diagram (GVD) is implemented.