[][src]Crate gear

Motion Planning Library for Robotics

Get the collision free trajectory of joint angles. ncollide3d is used to check the collision between the robot and the environment.

Structs

CollisionChecker

Collision checker for a robot

JacobianIKSolver

Inverse Kinematics Solver using Jacobian matrix

JointPathPlanner

Collision Avoidance Path Planner

JointPathPlannerBuilder

Builder pattern to create JointPathPlanner

JointPathPlannerWithIK

Joint path planner which supports inverse kinematics

RandomInitializeIKSolver

Randomize initial joint angles before solving

TrajectoryPoint

Enums

CollisionPart
Error

Error for gear

Traits

FromUrdf
InverseKinematicsSolver

IK solver

Functions

generate_clamped_joint_positions_from_limits

Clamp joint angles to set angles safely

generate_random_joint_positions_from_limits

Generate random joint angles from the optional limits

interpolate

Interpolate two vectors with the length

modify_to_nearest_angle

Find the nearest angle on is for the joints wihout limits

set_random_joint_positions

Set random joint angles

Type Definitions

Result

Result for gear