Skip to content

Commit 5757d9f

Browse files
Abishalinisea-bassadlarkin
authored
Add MTC to concepts (#809)
Co-authored-by: Sebastian Castro <[email protected]> Co-authored-by: Ashton Larkin <[email protected]>
1 parent be6270b commit 5757d9f

17 files changed

+847
-0
lines changed

doc/concepts/concepts.rst

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -11,5 +11,6 @@ Concepts
1111
move_group
1212
planning_scene_monitor
1313
trajectory_processing
14+
moveit_task_constructor/moveit_task_constructor
1415

1516
.. image:: /_static/images/moveit_pipeline.png
26.8 KB
Loading
12.8 KB
Loading
10.6 KB
Loading
9.6 KB
Loading
32 KB
Loading
266 KB
Loading
47.1 KB
Loading
13.7 KB
Loading
Lines changed: 45 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -0,0 +1,45 @@
1+
.. _Connecting Stages:
2+
3+
#################
4+
Connecting Stages
5+
#################
6+
7+
| MTC provides only one connecting stage called Connect.
8+
| A connect stage solves for a feasible trajectory between the start and goal states.
9+
10+
Connect
11+
-------
12+
13+
| The ``Connect`` stage connects two stages by finding a motion plan between the start and end goal given by the adjacent stages.
14+
| The default cost term depends on path length.
15+
| The default planning time for this stage is 1.0s.
16+
17+
.. list-table:: Properties to be set by user
18+
:widths: 25 100 80
19+
:header-rows: 1
20+
21+
* - Property Name
22+
- Function to set property
23+
- Description
24+
* - merge_mode
25+
-
26+
- Define the merge strategy to use when performing planning operations. This parameter is an enum type. Can be SEQUENTIAL(Store sequential trajectories) or WAYPOINTS(Join trajectories by their waypoints). Default is WAYPOINTS.
27+
* - path_constaints
28+
- void setPathConstraints(moveit_msgs/Constraints path_constraints)
29+
- Constraints to maintain during trajectory
30+
* - merge_time_parameterization
31+
-
32+
- Default is TOTG (Time-Optimal Trajectory Generation). Information about TOTG is available in the :ref:`Time Parameterization tutorial <doc/examples/time_parameterization/time_parameterization_tutorial:Time Parameterization Algorithms>`
33+
34+
`API doc for Connect <https://ros-planning.github.io/moveit_task_constructor/_static/classmoveit_1_1task__constructor_1_1stages_1_1Connect.html>`_.
35+
36+
Code Example
37+
38+
.. code-block:: c++
39+
40+
auto node = std::make_shared<rclcpp::Node>();
41+
// planner used for connect
42+
auto pipeline = std::make_shared<solvers::PipelinePlanner>(node, "ompl", "RRTConnectkConfigDefault");
43+
// connect to pick
44+
stages::Connect::GroupPlannerVector planners = { { "arm", pipeline }, { "gripper", pipeline } };
45+
auto connect = std::make_unique<stages::Connect>("connect", planners);

0 commit comments

Comments
 (0)