trajectory-generation
There are 184 repositories under trajectory-generation topic.
petercorke/robotics-toolbox-python
Robotics Toolbox for Python
Unity-Technologies/Unity-Robotics-Hub
Central repository for tools, tutorials, resources, and documentation for robotics simulation in Unity.
jiachenli94/Awesome-Interaction-Aware-Trajectory-Prediction
A selection of state-of-the-art research materials on trajectory prediction
petercorke/robotics-toolbox-matlab
Robotics Toolbox for MATLAB
pantor/ruckig
Motion Generation for Robots and Machines. Real-time. Jerk-constrained. Time-optimal.
adham-elarabawy/open-quadruped
An open-source 3D-printed quadrupedal robot. Intuitive gait generation through 12-DOF Bezier Curves. Full 6-axis body pose manipulation. Custom 3DOF Leg Inverse Kinematics Model accounting for offsets.
ayushgaud/path_planning
Quadcopter path planning using RRT* and minimum jerk trajectory generation
theislab/cellrank
CellRank: dynamics from multi-view single-cell data
Unity-Technologies/Robotics-Object-Pose-Estimation
A complete end-to-end demonstration in which we collect training data in Unity and use that data to train a deep neural network to predict the pose of a cube. This model is then deployed in a simulated robotic pick-and-place task.
pantor/frankx
High-Level Motion Library for Collaborative Robots
UW-ACL/SCPToolbox.jl
Sequential Convex Programming Toolbox for nonconvex trajectory optimization.
JaciBrunning/Pathfinder
Cross-Platform, Multi-Use Motion Profiling and Trajectory Generation
dpeerlab/Palantir
Single cell trajectory detection
jiachenli94/Awesome-Decision-Making-Reinforcement-Learning
A selection of state-of-the-art research materials on decision making and motion planning.
icsl-Jeon/traj_gen
Optimal trajectory generation library given equality and inequality constraints (C++/Matlab)
bobzwik/Quadcopter_SimCon
Quadcopter Simulation and Control. Dynamics generated with PyDy.
Sarrasor/RoboticManipulators
Calculation of forward and inverse kinematics, Jacobian matrices, dynamic modeling, trajectory planning and geometric calibration for robotic manipulators
SS47816/fiss_planner
[RA-L 2022] FISS: A Trajectory Planning Framework using Fast Iterative Search and Sampling Strategy for Autonomous Driving
ZJU-FAST-Lab/Implicit-SVSDF-Planner
[SIGGRAPH 2024 & TOG]
eric-heiden/grips
Gradient-Informed Path Smoothing for Wheeled Mobile Robots (GRIPS)
Logan-Shi/UAV-motion-control
MATLAB implementation of UAV (unmanned aerial vehicle) control simulation, with RRT (rapidly exploring random tree) for path planning, B-Spline for trajectory generation and LP (linear programming) for trajectory optimization.
carlosluis/online_dmpc
Code accompanying the RA-L / ICRA 2020 paper: "Online Trajectory Generation with Distributed Model Predictive Control for Multi-Robot Motion Planning"
Bharath2/Quadrotor-Simulation
Trajectory Planning and control
rafaelrojasmiliani/gsplines_cpp
Generalized Splines for Motion Optimization in C++ and python3
SS47816/frenet_optimal_planner
Implementation of the Frenet Optimal Planning Algorithm (with modifications) in ROS.
yulinliu101/DeepTP
A deep generative model to predict aircraft actual trajectories using high dimensional weather data
bostoncleek/quadruped_control
Quadruped control architecture
movetk/movetk
MoveTK is a library for computational movement analysis written in C++.
marcbone/s_curve
S-Curve trajectory generator written in rust
MahanFathi/LQR-RRTstar
LQR-RRT* method is used for random motion planning of a simple pendulum in it's phase plot
icsl-Jeon/traj_gen-matlab
Optimal trajectory generation
SS47816/fiss_plus_planner
[IROS 2023] FISS+: Efficient and Focused Trajectory Generation and Refinement using Fast Iterative Search and Sampling Strategy
prajval10/Platoon_control
Control system design for platoon of autonomous vehicles
borisRadonic/ToolboxR
Discrete Time C++ Modeling Library
chenzhike110/Lattice-Planner
simple EM-planner
wljungbergh/mpc-trajectory-generator
A trajectory generator utilizing the A-star algorithm in conjunction with a Nonlinear Model Predictive Control solver to obtain a smooth trajectory that satisfies vehicle constraints.