Pinned Repositories
--original--Trajectory-optimization-based-on-Bezier-polynomial-motion-planning-
基于贝赛尔曲线的轨迹优化: 前段:Astar寻径 后端:运动走廊膨胀+Bezier
AB3DMOT
Official Python Implementation for "A Baseline for 3D Multi-Object Tracking", In Submission
ad_with_lanelet2
sample of ad system to use lanelet2 framework
ai_for_robotics
Visualizations of algorithms covered in Sebastian Thrun's excellent Artificial Intelligence for Robotics course on Udacity.
Apollo-Note
Note for Apollo 3.0 perception, prediction and planning modules
Around-view-moniter
A c++ program to generate offline tables from paramters in xml
Artificial-Intellegence
人工智能的作业
genesis_path_follower
MPC Path Follower for the Hyundai Genesis.
OpenStreetMap-Route-Planner
Implemented a Google-maps style routing algorithm with C++. Applied A star search algorithm to OpenStreetMap data and IO2D map display code to find a path between two points on the map.
PythonRobotics
Python sample codes for robotics algorithms.
378281820qq's Repositories
378281820qq/AB3DMOT
Official Python Implementation for "A Baseline for 3D Multi-Object Tracking", In Submission
378281820qq/OpenStreetMap-Route-Planner
Implemented a Google-maps style routing algorithm with C++. Applied A star search algorithm to OpenStreetMap data and IO2D map display code to find a path between two points on the map.
378281820qq/autoware_tracker
Minimum code needed to run Autoware multi-object tracking
378281820qq/AutowareArchitectureProposal
This is the source code of the feasibility study for Autoware architecture proposal.
378281820qq/awesome-robotics-libraries
:sunglasses: A curated list of robotics libraries and software
378281820qq/canmatrix
Converting Can (Controller Area Network) Database Formats .arxml .dbc .dbf .kcd ...
378281820qq/canmsg_pack_unpack_by_given_dbc
378281820qq/eigen-QP
Quadradic Programming solver using Eigen
378281820qq/HybridAStarSearch
378281820qq/Landmark_Detection_Robot_Tracking_SLAM-
Simultaneous Localization and Mapping(SLAM) also gives you a way to track the location of a robot in the world in real-time and identify the locations of landmarks such as buildings, trees, rocks, and other world features.
378281820qq/lidar_gnss_mapping
378281820qq/LIO-SAM_based_relocalization
A simple system that can relocalize a robot on a built map is developed in this system. The system is based on LIO-SAM.
378281820qq/livox_horizon_loam
Livox horizon porting for loam
378281820qq/loam_livox
A robust LiDAR Odometry and Mapping (LOAM) package for Livox-LiDAR
378281820qq/Motion-Planning-Course
Motion Planning for Mobile Robots Course
378281820qq/MotionPlanning-1
Motion planning algorithms commonly used on autonomous vehicles. (path planning + path tracking)
378281820qq/multirobot_formation
基于ros的多机器人仿真(导航、编队)
378281820qq/osqp
The Operator Splitting QP Solver
378281820qq/path_optimizer
Real-time path planning for non-holonomic vehicles.
378281820qq/Path_Planning_and_Control_Demo
378281820qq/path_smoother
smooth path/curve with Gradient Descent method
378281820qq/PCL-ICP-NDT
This is sample lidar ICP/NDT code by using PCL 1.7
378281820qq/PublicCourse
Homeworks for public courses.
378281820qq/ros_best_practices
Best practices, conventions, and tricks for ROS
378281820qq/sc_lego_loam_noted
sc lego loam 加了些注释
378281820qq/simple_ros_client_application
A desktop application using the Qt framework to publish messages over a websocket connection to utilize ROS service and pub/sub functionality. The published messages can control the movements a ROS tool known as turtlesim.
378281820qq/SwarmSim
Multi-robot control simulation environmrnt build on top on Mobile Robotics Simulation Toolbox, implemented 1)some algorithm for formation control 2)mapping, localization and SLAM based on Kalman filter..
378281820qq/traversability_mapping
Bayesian Generalized Kernel Inference for Terrain Traversability Mapping
378281820qq/UdacityCPP
Udacity C++ Nanodegree Program
378281820qq/Vehicle-Detection-and-Tracking
Computer vision based vehicle detection and tracking using Tensorflow Object Detection API and Kalman-filtering