EXOTica
6.2.0
Installing EXOTica
EXOTica overview
Quickstart: Python
Quickstart: C++
Solving planning problems in C++
Creating a planner package for your own robot
Initialization
Manual Initialization
XML Initialization
XML Parsing
Common Initialization Step
Setting up ROSlaunch
Setting up Problems and Solvers
Task space vector handling
Visualisation
Initializers
Task Maps
Code Formatting
Code Styleguide and Naming Convention
Python Bindings
Doxygen C++
Documentation
EXOTica
»
Index
Index
A
|
B
|
C
|
D
|
E
|
F
|
G
|
H
|
I
|
J
|
K
|
L
|
M
|
N
|
O
|
P
|
Q
|
R
|
S
|
T
|
U
|
V
|
W
|
X
|
Y
|
Z
A
a() (pyexotica.Plane property)
AbstractDDPSolver (class in exotica_ddp_solver_py)
add_object() (pyexotica.Scene method)
add_object_to_environment() (pyexotica.Scene method)
add_trajectory() (pyexotica.Scene method)
add_trajectory_from_array() (pyexotica.Scene method)
add_trajectory_from_file() (pyexotica.Scene method)
always_externally_updated_collision_scene() (pyexotica.CollisionScene property)
AnalyticDDPSolver (class in exotica_ddp_solver_py)
AngleAxis (pyexotica.RotationType attribute)
apply_start_state() (pyexotica.PlanningProblem method)
ARG0 (pyexotica.ArgumentPosition attribute)
ARG1 (pyexotica.ArgumentPosition attribute)
ARG2 (pyexotica.ArgumentPosition attribute)
ARG3 (pyexotica.ArgumentPosition attribute)
ARG4 (pyexotica.ArgumentPosition attribute)
ArgumentPosition (class in pyexotica)
attach_object() (pyexotica.Scene method)
attach_object_local() (pyexotica.Scene method)
B
b() (pyexotica.Plane property)
BacktrackIterationLimit (pyexotica.TerminationCriterion attribute)
BaseType (class in pyexotica)
BKPIECESolver (class in exotica_ompl_solver_py)
Box (class in pyexotica)
BOX (pyexotica.ShapeType attribute)
box_qp() (in module pyexotica)
box_qp_old() (in module pyexotica)
BoxQPSolution (class in pyexotica)
C
c() (pyexotica.Plane property)
CenterOfMass (class in exotica_core_task_maps_py)
check_dynamics_solver_derivatives() (in module pyexotica)
check_trajectory_continuous_time() (in module pyexotica)
check_whether_trajectory_is_collision_free_by_subsampling() (in module pyexotica)
clamped_idx() (pyexotica.BoxQPSolution property)
clean_scene() (pyexotica.Scene method)
clear() (exotica_ompl_solver_py.LazyPRMSolver method)
(exotica_ompl_solver_py.PRMSolver method)
clear_query() (exotica_ompl_solver_py.LazyPRMSolver method)
(exotica_ompl_solver_py.PRMSolver method)
CollisionDistance (class in exotica_core_task_maps_py)
CollisionProxy (class in pyexotica)
CollisionScene (class in pyexotica)
compute_derivatives() (pyexotica.DynamicsSolver method)
compute_goal_laplace() (exotica_core_task_maps_py.InteractionMesh static method)
compute_laplace() (exotica_core_task_maps_py.InteractionMesh static method)
computeTriangleNormals() (pyexotica.Mesh method)
computeVertexNormals() (pyexotica.Mesh method)
Cone (class in pyexotica)
CONE (pyexotica.ShapeType attribute)
contact_1() (pyexotica.CollisionProxy property)
contact_2() (pyexotica.CollisionProxy property)
contact_transform_1() (pyexotica.ContinuousCollisionProxy property)
contact_transform_2() (pyexotica.ContinuousCollisionProxy property)
continuous_collision_check() (pyexotica.CollisionScene method)
ContinuousCollisionProxy (class in pyexotica)
control_cost_evolution() (exotica_ddp_solver_py.AbstractDDPSolver property)
ControlCostLossTermType (class in pyexotica)
controlled_joint_to_collision_link_map() (pyexotica.Scene property)
ControlLimitedDDPSolver (class in exotica_ddp_solver_py)
ControlLimitedFeasibilityDrivenDDPSolver (class in exotica_ddp_solver_py)
ControlRegularization (class in exotica_core_task_maps_py)
Convergence (pyexotica.TerminationCriterion attribute)
create_dynamics_solver() (pyexotica.Setup static method)
create_problem() (pyexotica.Setup static method)
create_scene() (pyexotica.Setup static method)
create_solver() (pyexotica.Setup static method)
Cylinder (class in pyexotica)
CYLINDER (pyexotica.ShapeType attribute)
D
d() (pyexotica.Plane property)
data() (pyexotica.TaskSpaceVector property)
ddPhi_ddu() (pyexotica.TimeIndexedTask property)
ddPhi_ddx() (pyexotica.TimeIndexedTask property)
ddPhi_dxdu() (pyexotica.TimeIndexedTask property)
debug_mode() (pyexotica.Object property)
delete() (pyexotica.VisualizationMeshcat method)
detach_object() (pyexotica.Scene method)
diff() (pyexotica.KDLFrame static method)
display_scene() (pyexotica.VisualizationMeshcat method)
display_state() (pyexotica.VisualizationMeshcat method)
display_trajectory() (pyexotica.VisualizationMeshcat method)
(pyexotica.VisualizationMoveIt method)
Distance (class in exotica_core_task_maps_py)
distance() (pyexotica.CollisionProxy property)
Divergence (pyexotica.TerminationCriterion attribute)
dPhi_du() (pyexotica.TimeIndexedTask property)
dPhi_dx() (pyexotica.TimeIndexedTask property)
dt() (pyexotica.DynamicsSolver property)
DynamicsSolver (class in pyexotica)
E
edge_count() (exotica_ompl_solver_py.LazyPRMSolver method)
(exotica_ompl_solver_py.PRMSolver method)
EffAxisAlignment (class in exotica_core_task_maps_py)
EffBox (class in exotica_core_task_maps_py)
EffFrame (class in exotica_core_task_maps_py)
EffOrientation (class in exotica_core_task_maps_py)
EffPosition (class in exotica_core_task_maps_py)
end_point() (exotica_core_task_maps_py.PointToLine property)
EndPoseTask (class in pyexotica)
ESTSolver (class in exotica_ompl_solver_py)
exotica_core_task_maps_py
module
exotica_ddp_solver_py
module
exotica_examples_py
module
exotica_ilqg_solver_py
module
exotica_ilqr_solver_py
module
exotica_ompl_solver_py
module
expand_roadmap() (exotica_ompl_solver_py.PRMSolver method)
F
F() (pyexotica.DynamicsSolver method)
f() (pyexotica.DynamicsSolver method)
FeasibilityDrivenDDPSolver (class in exotica_ddp_solver_py)
FeedbackMotionSolver (class in pyexotica)
Fixed (pyexotica.BaseType attribute)
fk() (pyexotica.Scene method)
Floating (pyexotica.BaseType attribute)
free_idx() (pyexotica.BoxQPSolution property)
fs() (exotica_ddp_solver_py.FeasibilityDrivenDDPSolver property)
fu() (exotica_ddp_solver_py.AbstractDDPSolver property)
(pyexotica.DynamicsSolver method)
fu_fd() (pyexotica.DynamicsSolver method)
FunctionTolerance (pyexotica.TerminationCriterion attribute)
fx() (exotica_ddp_solver_py.AbstractDDPSolver property)
(pyexotica.DynamicsSolver method)
fx_fd() (pyexotica.DynamicsSolver method)
G
get_angle_axis() (pyexotica.KDLFrame method)
get_axis() (exotica_core_task_maps_py.EffAxisAlignment method)
get_colliding_links() (in module pyexotica)
get_collision_distance() (pyexotica.Scene method)
get_collision_proxies() (exotica_core_task_maps_py.CollisionDistance method)
get_collision_robot_links() (pyexotica.Scene method)
get_collision_scene() (pyexotica.Scene method)
get_collision_scenes() (pyexotica.Setup static method)
get_collision_world_links() (pyexotica.Scene method)
get_controlled_joint_names() (pyexotica.Scene method)
get_controlled_link_names() (pyexotica.Scene method)
get_controlled_state() (pyexotica.Scene method)
get_cost_evolution() (pyexotica.PlanningProblem method)
get_direction() (exotica_core_task_maps_py.EffAxisAlignment method)
get_duration() (pyexotica.Timer method)
get_dynamics_solver() (pyexotica.Scene method)
get_dynamics_solvers() (pyexotica.Setup static method)
get_feedback_control() (pyexotica.FeedbackMotionSolver method)
get_file_url() (pyexotica.VisualizationMeshcat method)
get_frame() (pyexotica.KDLFrame method)
get_Fu() (pyexotica.DynamicsSolver method)
get_fu() (pyexotica.DynamicsSolver method)
get_Fx() (pyexotica.DynamicsSolver method)
get_fx() (pyexotica.DynamicsSolver method)
get_goal() (pyexotica.EndPoseTask method)
(pyexotica.SamplingTask method)
(pyexotica.TimeIndexedTask method)
get_initializers() (pyexotica.Setup static method)
get_kinematic_tree() (pyexotica.Scene method)
get_lower_limit() (exotica_core_task_maps_py.EffBox method)
get_maps() (pyexotica.Setup static method)
get_model_joint_names() (pyexotica.Scene method)
get_model_link_names() (pyexotica.Scene method)
get_model_state() (pyexotica.Scene method)
get_model_state_map() (pyexotica.Scene method)
get_number_of_iterations() (pyexotica.PlanningProblem method)
get_number_of_problem_updates() (pyexotica.PlanningProblem method)
get_package_path() (pyexotica.Setup static method)
get_planning_time() (pyexotica.MotionSolver method)
get_position() (pyexotica.DynamicsSolver method)
get_problem() (pyexotica.MotionSolver method)
get_problems() (pyexotica.Setup static method)
get_quaternion() (pyexotica.KDLFrame method)
get_rho() (pyexotica.EndPoseTask method)
(pyexotica.SamplingTask method)
(pyexotica.TimeIndexedTask method)
get_robot_to_robot_collision_distance() (pyexotica.CollisionScene method)
get_robot_to_world_collision_distance() (pyexotica.CollisionScene method)
get_root_frame_name() (pyexotica.Scene method)
get_root_joint_name() (pyexotica.Scene method)
get_rpy() (pyexotica.KDLFrame method)
get_S() (pyexotica.EndPoseTask method)
(pyexotica.TimeIndexedTask method)
get_scene() (pyexotica.PlanningProblem method)
(pyexotica.Scene method)
get_solvers() (pyexotica.Setup static method)
get_task_error() (pyexotica.EndPoseTask method)
(pyexotica.TimeIndexedTask method)
get_task_jacobian() (pyexotica.EndPoseTask method)
get_task_maps() (pyexotica.PlanningProblem method)
get_tasks() (pyexotica.PlanningProblem method)
get_trajectory() (pyexotica.Scene method)
get_translation() (pyexotica.CollisionScene method)
(pyexotica.KDLFrame method)
get_translation_and_angle_axis() (pyexotica.KDLFrame method)
get_translation_and_quaternion() (pyexotica.KDLFrame method)
get_translation_and_rpy() (pyexotica.KDLFrame method)
get_translation_and_zyx() (pyexotica.KDLFrame method)
get_translation_and_zyz() (pyexotica.KDLFrame method)
get_tree_names() (pyexotica.Scene method)
get_upper_limit() (exotica_core_task_maps_py.EffBox method)
get_web_url() (pyexotica.VisualizationMeshcat method)
get_zyx() (pyexotica.KDLFrame method)
get_zyz() (pyexotica.KDLFrame method)
GetRandomSeed() (exotica_ompl_solver_py.OMPLMotionSolver method)
GradientTolerance (pyexotica.TerminationCriterion attribute)
grow_roadmap() (exotica_ompl_solver_py.PRMSolver method)
H
h() (exotica_core_task_maps_py.JointTorqueMinimizationProxy property)
has_attached_object() (pyexotica.Scene method)
has_quaternion_floating_base() (pyexotica.Scene property)
has_second_order_derivatives() (pyexotica.DynamicsSolver property)
hessian() (pyexotica.Scene method)
(pyexotica.TimeIndexedTask property)
Hff_inv() (pyexotica.BoxQPSolution property)
Huber (pyexotica.ControlCostLossTermType attribute)
I
id() (pyexotica.TaskIndexing property)
(pyexotica.TaskMap property)
ILQGSolver (class in exotica_ilqg_solver_py)
ILQRSolver (class in exotica_ilqr_solver_py)
in_collision() (pyexotica.ContinuousCollisionProxy property)
indexing() (pyexotica.TimeIndexedTask property)
init_ros() (pyexotica.Setup static method)
integrate() (pyexotica.DynamicsSolver method)
Integrator (class in pyexotica)
integrator() (pyexotica.DynamicsSolver property)
InteractionMesh (class in exotica_core_task_maps_py)
InteractiveCostTuning (class in pyexotica)
interpolate() (pyexotica.KDLFrame static method)
inverse() (pyexotica.KDLFrame method)
is_allowed_to_collide() (pyexotica.Scene method)
is_collision_free() (pyexotica.Scene method)
is_state_valid() (pyexotica.Scene method)
is_valid() (pyexotica.PlanningProblem method)
isFixed() (pyexotica.Plane method)
(pyexotica.Shape method)
IterationLimit (pyexotica.TerminationCriterion attribute)
J
jacobian() (pyexotica.EndPoseTask property)
(pyexotica.Scene method)
(pyexotica.TimeIndexedTask property)
joint_map() (exotica_core_task_maps_py.ControlRegularization property)
(exotica_core_task_maps_py.JointPose property)
joint_ref() (exotica_core_task_maps_py.ControlRegularization property)
(exotica_core_task_maps_py.JointPose property)
JointAccelerationBackwardDifference (class in exotica_core_task_maps_py)
JointJerkBackwardDifference (class in exotica_core_task_maps_py)
JointLimit (class in exotica_core_task_maps_py)
JointPose (class in exotica_core_task_maps_py)
JointTorqueMinimizationProxy (class in exotica_core_task_maps_py)
JointVelocityBackwardDifference (class in exotica_core_task_maps_py)
JointVelocityLimitConstraint (class in exotica_core_task_maps_py)
K
K() (exotica_ddp_solver_py.AbstractDDPSolver property)
k() (exotica_ddp_solver_py.AbstractDDPSolver property)
KDLFrame (class in pyexotica)
KDLRigidBodyInertia (class in pyexotica)
KDLRotationalInertia (class in pyexotica)
KDLVector (class in pyexotica)
KPIECESolver (class in exotica_ompl_solver_py)
L
L2 (pyexotica.ControlCostLossTermType attribute)
LazyPRMSolver (class in exotica_ompl_solver_py)
length() (pyexotica.Cone property)
(pyexotica.Cylinder property)
(pyexotica.TaskIndexing property)
(pyexotica.TaskMap property)
length_jacobian() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
length_Phi() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
lengthJ() (pyexotica.TaskIndexing property)
(pyexotica.TaskMap property)
load_problem() (pyexotica.Setup static method)
load_scene() (pyexotica.Scene method)
load_scene_file() (pyexotica.Scene method)
load_solver() (pyexotica.Setup static method)
load_solver_standalone() (pyexotica.Setup static method)
longest_valid_segment_length() (exotica_ompl_solver_py.OMPLMotionSolver property)
M
mainloop() (pyexotica.InteractiveCostTuning method)
Matrix (pyexotica.RotationType attribute)
max_iterations() (pyexotica.MotionSolver property)
maximum_extent() (exotica_ompl_solver_py.OMPLMotionSolver property)
mergeVertices() (pyexotica.Mesh method)
Mesh (class in pyexotica)
MESH (pyexotica.ShapeType attribute)
milestone_count() (exotica_ompl_solver_py.LazyPRMSolver method)
(exotica_ompl_solver_py.PRMSolver method)
model_link_to_collision_link_map() (pyexotica.Scene property)
module
exotica_core_task_maps_py
exotica_ddp_solver_py
exotica_examples_py
exotica_ilqg_solver_py
exotica_ilqr_solver_py
exotica_ompl_solver_py
pyexotica
MotionSolver (class in pyexotica)
multi_query() (exotica_ompl_solver_py.LazyPRMSolver property)
(exotica_ompl_solver_py.PRMSolver property)
N
N() (pyexotica.PlanningProblem property)
name (pyexotica.Box attribute)
(pyexotica.Cone attribute)
(pyexotica.Cylinder attribute)
(pyexotica.Plane attribute)
(pyexotica.Sphere attribute)
name() (pyexotica.ArgumentPosition property)
(pyexotica.BaseType property)
(pyexotica.ControlCostLossTermType property)
(pyexotica.Integrator property)
(pyexotica.Object property)
(pyexotica.RotationType property)
(pyexotica.ShapeType property)
(pyexotica.TerminationCriterion property)
namespace() (pyexotica.Object property)
ndx() (pyexotica.DynamicsSolver property)
normal_1() (pyexotica.CollisionProxy property)
normal_2() (pyexotica.CollisionProxy property)
NotStarted (pyexotica.TerminationCriterion attribute)
nq() (pyexotica.DynamicsSolver property)
nu() (pyexotica.DynamicsSolver property)
num_controls() (pyexotica.PlanningProblem property)
(pyexotica.Scene property)
num_positions() (pyexotica.PlanningProblem property)
(pyexotica.Scene property)
num_state() (pyexotica.Scene property)
num_state_derivative() (pyexotica.Scene property)
num_tasks() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
num_velocities() (pyexotica.PlanningProblem property)
(pyexotica.Scene property)
nv() (pyexotica.DynamicsSolver property)
nx() (pyexotica.DynamicsSolver property)
O
Object (class in pyexotica)
object_1() (pyexotica.CollisionProxy property)
(pyexotica.ContinuousCollisionProxy property)
object_2() (pyexotica.CollisionProxy property)
(pyexotica.ContinuousCollisionProxy property)
OcTree (class in pyexotica)
OCTREE (pyexotica.ShapeType attribute)
OMPLMotionSolver (class in exotica_ompl_solver_py)
P
p() (pyexotica.KDLFrame property)
padd() (pyexotica.Shape method)
Phi() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
Planar (pyexotica.BaseType attribute)
Plane (class in pyexotica)
PLANE (pyexotica.ShapeType attribute)
PlanningProblem (class in pyexotica)
plot() (in module pyexotica)
plot_task_cost_over_time() (in module pyexotica)
PointToLine (class in exotica_core_task_maps_py)
pre_update() (pyexotica.PlanningProblem method)
print_supported_classes() (pyexotica.Setup static method)
PRMSolver (class in exotica_ompl_solver_py)
PseudoHuber (pyexotica.ControlCostLossTermType attribute)
publish_pose() (in module pyexotica)
publish_proxies() (pyexotica.Scene method)
publish_scene() (pyexotica.Scene method)
publish_time_indexed_trajectory() (in module pyexotica)
publish_trajectory() (in module pyexotica)
pyexotica
module
Q
Qu() (exotica_ddp_solver_py.AbstractDDPSolver property)
Quaternion (pyexotica.RotationType attribute)
quit_button() (pyexotica.InteractiveCostTuning method)
Quu() (exotica_ddp_solver_py.AbstractDDPSolver property)
Quu_inv() (exotica_ddp_solver_py.AbstractDDPSolver property)
Qux() (exotica_ddp_solver_py.AbstractDDPSolver property)
Qx() (exotica_ddp_solver_py.AbstractDDPSolver property)
Qxx() (exotica_ddp_solver_py.AbstractDDPSolver property)
R
radius() (pyexotica.Cone property)
(pyexotica.Cylinder property)
(pyexotica.Sphere property)
range() (exotica_ompl_solver_py.RRTConnectSolver property)
regularization_evolution() (exotica_ddp_solver_py.AbstractDDPSolver property)
remove_object() (pyexotica.Scene method)
remove_trajectory() (pyexotica.Scene method)
replace_cylinders_with_capsules() (pyexotica.CollisionScene property)
replace_primitive_shapes_with_meshes() (pyexotica.CollisionScene property)
reset() (pyexotica.Timer method)
reset_button() (pyexotica.InteractiveCostTuning method)
reset_number_of_problem_updates() (pyexotica.PlanningProblem method)
rho() (pyexotica.TimeIndexedTask property)
RK1 (pyexotica.Integrator attribute)
RK2 (pyexotica.Integrator attribute)
RK4 (pyexotica.Integrator attribute)
robot_link_padding() (pyexotica.CollisionScene property)
robot_link_scale() (pyexotica.CollisionScene property)
rotation_type() (exotica_core_task_maps_py.EffFrame property)
(exotica_core_task_maps_py.EffOrientation property)
RotationType (class in pyexotica)
RPY (pyexotica.RotationType attribute)
RRTConnectSolver (class in exotica_ompl_solver_py)
RRTSolver (class in exotica_ompl_solver_py)
S
S() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
SamplingTask (class in pyexotica)
save_button() (pyexotica.InteractiveCostTuning method)
scale() (pyexotica.Shape method)
scaleAndPadd() (pyexotica.Shape method)
Scene (class in pyexotica)
set_axis() (exotica_core_task_maps_py.EffAxisAlignment method)
set_button() (pyexotica.InteractiveCostTuning method)
set_direction() (exotica_core_task_maps_py.EffAxisAlignment method)
set_goal() (pyexotica.EndPoseTask method)
(pyexotica.SamplingTask method)
(pyexotica.TimeIndexedTask method)
set_model_state() (pyexotica.Scene method)
set_model_state_map() (pyexotica.Scene method)
set_previous_joint_state() (exotica_core_task_maps_py.JointAccelerationBackwardDifference method)
(exotica_core_task_maps_py.JointJerkBackwardDifference method)
(exotica_core_task_maps_py.JointVelocityBackwardDifference method)
(exotica_core_task_maps_py.JointVelocityLimitConstraint method)
set_property() (pyexotica.VisualizationMeshcat method)
set_rho() (pyexotica.EndPoseTask method)
(pyexotica.SamplingTask method)
(pyexotica.TimeIndexedTask method)
set_weight() (exotica_core_task_maps_py.InteractionMesh method)
set_zero() (pyexotica.TaskSpaceVector method)
Setup (class in pyexotica)
setup() (exotica_ompl_solver_py.LazyPRMSolver method)
(exotica_ompl_solver_py.PRMSolver method)
Shape (class in pyexotica)
ShapeType (class in pyexotica)
show() (in module pyexotica)
sig_int_handler() (in module pyexotica)
simulate() (pyexotica.DynamicsSolver method)
SmoothL1 (pyexotica.ControlCostLossTermType attribute)
solve() (pyexotica.MotionSolver method)
specify_problem() (pyexotica.MotionSolver method)
Sphere (class in pyexotica)
SPHERE (pyexotica.ShapeType attribute)
SphereCollision (class in exotica_core_task_maps_py)
start() (pyexotica.TaskIndexing property)
(pyexotica.TaskMap property)
start_state() (pyexotica.PlanningProblem property)
start_time() (pyexotica.PlanningProblem property)
startJ() (pyexotica.TaskIndexing property)
(pyexotica.TaskMap property)
state_delta() (pyexotica.DynamicsSolver method)
state_delta_derivative() (pyexotica.DynamicsSolver method)
state_delta_second_derivative() (pyexotica.DynamicsSolver method)
steplength_evolution() (exotica_ddp_solver_py.AbstractDDPSolver property)
StepTolerance (pyexotica.TerminationCriterion attribute)
SymplecticEuler (pyexotica.Integrator attribute)
T
T() (pyexotica.TimeIndexedTask property)
task_maps() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
task_space_dim() (pyexotica.TaskMap method)
task_space_jacobian_dim() (pyexotica.TaskMap method)
TaskIndexing (class in pyexotica)
TaskMap (class in pyexotica)
tasks() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
TaskSpaceVector (class in pyexotica)
termination_criterion() (pyexotica.PlanningProblem property)
TerminationCriterion (class in pyexotica)
time_of_contact() (pyexotica.ContinuousCollisionProxy property)
TimeIndexedTask (class in pyexotica)
Timer (class in pyexotica)
transform_1() (pyexotica.CollisionProxy property)
(pyexotica.ContinuousCollisionProxy property)
transform_2() (pyexotica.CollisionProxy property)
(pyexotica.ContinuousCollisionProxy property)
triangle_count() (pyexotica.Mesh property)
type() (pyexotica.Object property)
(pyexotica.Shape property)
U
U_ref() (exotica_ddp_solver_py.AbstractDDPSolver property)
U_try() (exotica_ddp_solver_py.AbstractDDPSolver property)
Undefined (pyexotica.ControlCostLossTermType attribute)
UNKNOWN_SHAPE (pyexotica.ShapeType attribute)
update() (pyexotica.Scene method)
update_collision_object_transforms() (pyexotica.CollisionScene method)
update_collision_objects() (pyexotica.Scene method)
update_planning_scene() (pyexotica.Scene method)
update_planning_scene_world() (pyexotica.Scene method)
update_scene_frames() (pyexotica.Scene method)
us() (exotica_ddp_solver_py.FeasibilityDrivenDDPSolver property)
UserDefined (pyexotica.TerminationCriterion attribute)
V
valid_segment_count_factor() (exotica_ompl_solver_py.OMPLMotionSolver property)
vertex_count() (pyexotica.Mesh property)
VisualizationMeshcat (class in pyexotica)
VisualizationMoveIt (class in pyexotica)
Vx() (exotica_ddp_solver_py.AbstractDDPSolver property)
Vxx() (exotica_ddp_solver_py.AbstractDDPSolver property)
W
W() (exotica_core_task_maps_py.InteractionMesh property)
world_link_padding() (pyexotica.CollisionScene property)
world_link_scale() (pyexotica.CollisionScene property)
world_links_to_exclude_from_collision_scene() (pyexotica.Scene property)
X
x() (pyexotica.BoxQPSolution property)
(pyexotica.KDLVector method)
X_ref() (exotica_ddp_solver_py.AbstractDDPSolver property)
X_try() (exotica_ddp_solver_py.AbstractDDPSolver property)
xs() (exotica_ddp_solver_py.FeasibilityDrivenDDPSolver property)
Y
y() (pyexotica.EndPoseTask property)
(pyexotica.KDLVector method)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
ydiff() (pyexotica.EndPoseTask property)
(pyexotica.SamplingTask property)
(pyexotica.TimeIndexedTask property)
Z
z() (pyexotica.KDLVector method)
Zero() (pyexotica.KDLRigidBodyInertia static method)
(pyexotica.KDLRotationalInertia static method)
(pyexotica.KDLVector static method)
ZYX (pyexotica.RotationType attribute)
ZYZ (pyexotica.RotationType attribute)