Pinned Repositories
--original--Trajectory-optimization-based-on-Bezier-polynomial-motion-planning-
基于贝赛尔曲线的轨迹优化: 前段:Astar寻径 后端:运动走廊膨胀+Bezier
01_PlanningAutoparking
a method CC-RRT-RS of Planning for SelfDriving AutoParking
3D_object_recognition
recognize and localize an object in 3D Point Cloud scene using VFH - SVMs based method and 3D-CNNs method
AA-SIPP-m
Algorithm for prioritized multi-agent path finding (MAPF) in grid-worlds. Moves into arbitrary directions are allowed (each agent is allowed to follow any-angle path on the grid). Timeline is continuous, i.e. action durations are not explicitly discretized into timesteps. Different agents' size and moving speed are supported. Planning is carried out in (x, y, \theta) configuration space, i.e. agents' orientation are taken into account.
aabbcc
Dynamic AABB trees in C++ with support for periodic systems.
aau_multi_robot
Multi-robot exploration by Alpen-Adria-Universität Klagenfurt
ackerman_ros_robot_gazebo_simulation
Ackerman robot on Gazebo ROS with move_base gmapping SLAM TEB planner
ackermann_controller
This package contains a ros_control controller for car-like vehicles.
ackermann_vehicle
ROS packages for simulating a vehicle with Ackermann steering
apollo_standalone
cmake version of apollo5.0
shike1239's Repositories
shike1239/ackerman_ros_robot_gazebo_simulation
Ackerman robot on Gazebo ROS with move_base gmapping SLAM TEB planner
shike1239/adaptive_clustering
Lightweight and Accurate Point Cloud Clustering
shike1239/awesome-point-cloud-analysis
A list of papers and datasets about point cloud analysis (processing)
shike1239/cilantro
A lean C++ library for working with point cloud data
shike1239/dynamic_robot_localization
Point cloud registration pipeline for robot localization and 3D perception
shike1239/EagerMOT
Official code for "EagerMOT: 3D Multi-Object Tracking via Sensor Fusion" [ICRA 2021]
shike1239/enps_dwa
A C++ ROS simulator for reactive social robot navigation based on Enzymatic Numerical P systems.
shike1239/GCOPTER
A General-Purpose Trajectory Optimizer for Multicopters
shike1239/GEM
GEM: Online Globally consistent dense elevation mapping for unstructured terrain.
shike1239/GitHub-Chinese-Top-Charts
:cn: GitHub中文排行榜,帮助你发现高分优秀中文项目、更高效地吸收国人的优秀经验成果;榜单每周更新一次,敬请关注!
shike1239/ground_based_autonomy_basic
Autonomous Navigation and Collision Avoidance for Ground Robots
shike1239/Hybrid_A_Star
Hybrid A Star algorithm C++ implementation
shike1239/hybrid_astar
混合A*算法,仅依赖于很少的库,便于移植到自己的项目中或者嵌入式系统
shike1239/Interactive-Pathfinder
An interactive program in which you can follow A* or Dijkstra's pathfinding algorithm step by step
shike1239/leetcode-master
《代码随想录》LeetCode 刷题攻略:200道经典题目刷题顺序,共60w字的详细图解,视频难点剖析,50余张思维导图,支持C++,Java,Python,Go,JavaScript等多语言版本,从此算法学习不再迷茫!🔥🔥 来看看,你会发现相见恨晚!🚀
shike1239/mesh_navigation
ROS Mesh Navigation Bundle
shike1239/Multi_Robots_DMPC
Cooperative control of the multiple mobile vehicles via distributed model predictive control to implement the following tasks including formation control, inter-vehicle obstacle avoidance and environment obstacle avoidance. Stability, feasibility and optimality must be guaranteed.
shike1239/online_dmpc
Code accompanying the RA-L / ICRA 2020 paper: "Online Trajectory Generation with Distributed Model Predictive Control for Multi-Robot Motion Planning"
shike1239/path-smoother
trajectory optimization
shike1239/path_optimizer
Optimization-based real-time path planning for vehicles.
shike1239/PathFinding.js
A comprehensive path-finding library for grid based games
shike1239/PFF_PeD
PointCloud Fast Filter for People Detection
shike1239/plane_fit_ground_filter
点云分割论文2017 Fast segmentation of 3d point clouds: A paradigm on lidar data for autonomous vehicle applications
shike1239/poly-decomp.js
Decompose 2D polygons into convex pieces.
shike1239/sbpl_dynamic_adaptive_planner
Code for path planning in dynamic environments with adaptive dimensionality
shike1239/SC-A-LOAM
Robust LiDAR SLAM
shike1239/Self-driving-vehicle
Simulation of path planning for self-driving vehicles in Unity. This is also an implementation of the Hybrid A* pathfinding algorithm which is useful if you are interested in pathfinding for vehicles.
shike1239/tare_planner
TARE Exploration Planner for Ground Vehicles
shike1239/teb_local_planner
teb local planner without ros, teb 局部路径规划算法,非ROS
shike1239/tinynurbs
C++ library for NURBS curves and surfaces