Multi-query Robotic Manipulator Task Sequencing with
Gromov-Hausdorff Approximations
Abstract
Robotic manipulator applications often require efficient online motion planning. When completing multiple tasks, sequence order and choice of goal configuration can have a drastic impact on planning performance. This is well known as the robot task sequencing problem (RTSP). Existing general-purpose RTSP algorithms are susceptible to producing poor-quality solutions or failing entirely when available computation time is restricted. We propose a new multi-query task sequencing method designed to operate in semi-structured environments with a combination of static and non-static obstacles. Our method intentionally trades off workspace generality for planning efficiency. Given a user-defined task space with static obstacles, we compute a subspace decomposition. The key idea is to establish approximate isometries known as -Gromov-Hausdorff approximations that identify points that are close to one another in both task and configuration space. Importantly, we prove bounded suboptimality guarantees on the lengths of paths within these subspaces. These bounding relations further imply that paths within the same subspace can be smoothly concatenated, which we show is useful for determining efficient task sequences. We evaluate our method with several kinematic configurations in a complex simulated environment, achieving up to 3x faster motion planning and 5x lower maximum trajectory jerk compared to baselines.
Index Terms:
Task sequencing, planning, scheduling and coordination, motion and path planning, industrial robots.I INTRODUCTION








Planning algorithms for emerging applications of robotic manipulators must support a greater degree of autonomy than has traditionally been necessary. Robotic manipulators such as cobots (collaborative robots), for example, are designed for advanced manufacturing applications where they should operate safely in dynamic work environments shared with humans and should be able to adapt quickly to perform a variety of tasks. These applications share a need for agility and rapid deployment that differs substantially from traditional applications of industrial manipulators, which are typically characterised by repetitive motions in highly structured environments with planning performed completely offline.
Real world applications often require completing a set of tasks; for example, surface inspection, drilling, spray-painting, screw fastening and spot-welding. Determining an efficient task sequence for high-dimensional robot manipulators is challenging due to their kinematic redundancy; that is, a goal pose of the end effector can be achieved via multiple joint configurations. Additionally, the cost induced by the low-level motion between tasks must be reasoned about. Determining an efficient sequence that considers the above is known as the robot task sequencing problem (RTSP) [1].
While general-purpose online RTSP algorithms exist, they either decouple the low-level motion [2, 3] or only partially reason about the low-level motion during sequencing [4]. Furthermore, these algorithms do not offer any performance guarantees. In this paper, we show that this can often lead to highly sub-optimal path sequences and poor motion planning performance. While methods that explicitly consider low-level motion do exist, they are too slow for online settings [5].
We are interested in developing a method that efficiently solves the RTSP for practical situations that require repeated, rapid, and reliable planning, where major structures in the environment are static. A common example is a manipulator that must inspect and grasp objects from shelves and cabinets in a domestic or warehouse environment [6, 7, 8]. The shelves are static and their dimensions can be measured beforehand, while the objects on the shelves might not be known and their locations can change.
Multi-query planners such as the probabilistic roadmap (PRM) [9] aim to gain efficiency through computational reuse; a computationally costly offline process generates a data structure that can then be repeatedly queried efficiently by a low-cost online process. Inspired by PRMs, in this work, we seek a data structure that facilitates fast online task sequencing whilst providing some practical path quality guarantees.
Critically, we identify a particularly desirable property of motion plans: if two coordinates are close in task space, a smooth, short path exists between them in configuration space. We propose to decompose the task space into subspaces, such that paths through a particular subspace satisfy this property. We achieve this by establishing a bounding relation between distances in task space and corresponding distances in configuration space. Such a mapping between metric spaces is known as an -Gromov-Hausdorff approximation (-GHA).
We present the Hausdorff approximation planner (HAP)111Open-source implementation of HAP available at: https://github.com/UTS-RI/HAP-py which, given a task space and obstacle configuration, computes a set of covering -GHAs. These mappings provide a compact structure to efficiently plan over and additionally disambiguate kinematic redundancy by providing a unique mapping from task space to configuration space. This is key to our approach for efficiently solving RTSPs where multiple tasks can be clustered based on their associated subspaces, resulting in a set of reduced sequencing problems that can be solved independently.
A motivating example of this subspace decomposition for a 2-DOF manipulator is shown in Fig. 1. Here, the two subspaces overlap in task space. However, when mapped to configuration space via an -GHA two disjoint subspaces are revealed. Fig. 2 illustrates a scenario where this mapping is useful for planning efficient path sequences that remain in a single subspace. As can be seen in the figure, a naive greedy approach that only considers task-space distances results in unnecessary wasted motion as opposed to our method which utilises the subspace knowledge. In higher dimensions, these subspaces may be less obvious to choose from. For example, for 6-DOF or 7-DOF robot arms, several of these subspaces exist. Examples include, wrist/elbow/shoulder-in versus wrist/elbow/shoulder-out configurations and even permutations of these resulting from multiple possible revolutions around each joint.
We evaluate our method in a complex simulated bookshelf environment where a varying number of tasks must be completed in an efficient order. To highlight HAP’s applicability to a variety of kinematic configurations we perform experiments with 6-DOF and 7-DOF manipulators and with a manipulator mounted to a mobile base. Compared to state-of-the-art RTSP methods, our method achieves up to 3x faster motion planning and 5x lower maximum trajectory jerk with consistently higher planning success, even when unknown objects are added to the scene.
In summary, the main contributions of this paper are as follows. 1) The HAP framework, a multi-query method for solving RTSPs which, in contrast to previous work, explicitly considers the low-level motion of the robot. 2) A bounded suboptimality analysis which provides theoretical guarantees on the quality of paths through the -GHAs computed by HAP. 3) An extensive evaluation of HAP against state-of-the-art baselines.
II RELATED WORK
In this section we describe and analyse related work in the literature with respect to our approach. We begin by exploring the origins of the robot task sequencing problem and discuss its development in recent years. We conclude the section with a brief discussion on relevant work in motion planning and useful properties of our framework in such contexts.
II-A Robot Task Sequencing
The RTSP is a well-studied problem, and approaches can generally be divided into offline and online approaches. Offline approaches tend to formulate the problem as a generalised TSP (GTSP) [10] (also known as the set TSP) where task inverse kinematics (IK) solutions are formed into subsets and the shortest tour between subsets must be found [1]. Determining an optimal sequence generally takes several minutes to hours for 6-DOF and higher robot arms, even when ignoring the cost of the low-level motion of the robot and are thus unsuitable for online planning [11, 12, 13].
Online methods sacrifice sequence optimality for faster planning. For example, if the kinematic redundancy of the arm is ignored and only task-space distances are considered, then the sequencing problem can be treated as a TSP [14, 15]. While this results in much faster task sequencing, task-space costs can heavily underestimate the true cost of moving between tasks due to the non-linear nature of high-dimensional robot arms [16].
Decoupled approaches overcome this limitation by first computing a sequence in task space and then determining an optimal goal configuration assignment. For example, RoboTSP [2] initially computes a sequence using task-space distance and then assigns optimal joint configurations to each task using a graph search algorithm. The work in [3] adds an extra filtering step to RoboTSP which removes dissimilar candidate IK solutions from the graph search which results in faster task sequencing yet similar execution times. While these decoupled approaches are an improvement over task-space sequencing alone, the choice of configuration assignment is dependent on the initial task sequence and may still produce highly suboptimal trajectories.
More recently, Cluster-RTSP [4] was proposed to overcome the shortcomings of decoupled approaches by directly sequencing in configuration space. To make the problem tractable, unique configurations are first assigned to each task based on a best-fit heuristic. These configurations are then clustered into groups and a sequence is found by solving inter-cluster and intra-cluster TSPs individually. While this method achieved a large reduction in task execution and computation times compared to RoboTSP, the travel costs used for sequencing were still Euclidean distance between assigned task configurations which may not effectively capture costs incurred by the true low-level motion, for example, due to obstacle avoidance. Furthermore, outlier tasks with highly dissimilar IK solutions can heavily impact the overall quality of the task sequence.
Learning-based approaches have been proposed to solve RTSPs. For example, in [17] the problem was framed as a Markov decision process and a reinforcement learning algorithm learned a policy that outputs a time and energy efficient task sequence and corresponding goal IK solution for a robot spot welding task. While results show an overall reduction in computation time and trajectory efficiency compared to offline methods, they assume no obstacles between tasks. Given the black-box nature of learning-based approaches it is unclear how well they generalise to the more complex cluttered environments we consider in this work.
The Mobile Manipulator RTSP extends this problem to mobile manipulators. The work in [18] approaches this problem by clustering tasks based on the arm’s reachability from a finite set of base poses. A minimum set of base poses is then chosen and RoboTSP is used to sequence each cluster. We show that -GHAs can be naturally extended to mobile bases and enhance subspace allocation, allowing for greater flexibility in subspace assignments in addition to operating in potentially larger workspaces.
While RTSP methods exist that explicitly consider trajectory costs, they either simplify the problem or are intractable for anything other than a small number of tasks. For example, in [19] configurations are arbitrarily chosen for each task and motion plans and generated between them. In [5] the RTSP was formulated as a combined set covering problem and TSP (SCTSP) and trajectories were exhaustively computed between all possible goal configuration assignments which took 3 hours for 400 tasks. In [20] a genetic algorithm was used to find an optimal sequence that considered obstacle avoidance in its optimisation objective. However, problems with only 15 tasks were considered and computation times were not reported. The work in [21] formulated a robotic laser welding problem as a TSP with neighborhoods (TSPN) and was given a computation budget of 600 seconds for up to 71 tasks; however, obstacles were ignored. In contrast, HAP computes a task-space decomposition that considers robot kinematics and prior obstacle knowledge in a reasonable amount of time and facilitates rapid online multi-query task sequencing with high-quality trajectories.
II-B Motion Planning
Our framework has useful properties for motion planning applications. As we will show, trajectories contained within -GHAs are useful as seed trajectories for trajectory optimisation methods [22]. These methods are well-known to be sensitive to the initial seed trajectory and susceptible to failing due to local minima [23]. Trajectories contained within -GHAs mitigate this issue since they consider manipulator kinematics and a priori knowledge of the environment.
Work in integrated task and motion planning [24] typically utilise some decomposition of the workspace for problem reduction. For example, in [25] authors characterise a lower-dimensional subspace of valid grasp and place configurations. A roadmap is then constructed over these subspaces to search for transit/ transfer modes. However, the construction of these subspaces is mainly concerned with feasibility rather than efficiency.
Additionally, other aspects of our approach share similarities with trajectory library methods [26, 27, 28], workspace decomposition [29, 30] and manipulator coverage planning [31, 32]. However, our approach differs in that the task-space decomposition and paths through them are constructed specifically in a way to facilitate efficient robot manipulator task sequencing. Furthermore, we provide practical guarantees on the lengths of paths through the decomposition which leads to predictable and well-defined behaviour.
III PROBLEM FORMULATION
Here we provide necessary notation and problem definitions for describing the RTSP. We then provide an overview of our approach which reduces the RTSP complexity via subspace knowledge.



III-A Notation
represents the configuration space of the robot. In this work we target serial manipulators. The workspace, , is the 3D Euclidean workspace, . Given a configuration , denotes the space occupied by the robot model at configuration . is an approximate model of the environmental obstacles. We assume access to a collision checking process that reports whether the arm is in collision with or with itself. The obstacle region is defined as , from which we obtain the free space region . A task, modelled as a 6D pose , typically has a set of inverse kinematics (IK) solutions . Then, the task space is the set of poses of the robot’s end effector for which valid IK solutions, exist. Any IK solution is considered valid if . is a discrete approximation of the subset of where the robot is expected to operate frequently. Summary of notation can be found in Table LABEL:table:notation.
III-B Robot Task Sequencing
To complete a given task chosen from the task space the manipulator must position its end effector at pose while avoiding collision. We are interested in finding a minimum cost path in that completes task . The manipulator’s path is modelled as a discrete sequence of configurations . We measure the length of a path using a metric on the configuration space,
(1) |
It is convenient to consider the starting pose of the end effector to be the goal pose of the previous task. A manipulator may be able to achieve the goal pose with multiple, possibly infinite, configurations. We are therefore interested in the set of paths (sequence of configurations) of varying length between task and , , leading to the following problem definition.
Problem 1 (Manipulator goal configuration assignment problem).
Find a goal configuration that achieves the shortest collision-free path in configuration space between two tasks and in ,
(2) |
The operational scenarios that motivate this work often involve more than one task. The manipulator is given an unordered set of tasks . This set of tasks can be viewed as a batch-query scenario where all tasks must be completed while minimising total cost. Thus, it is necessary to choose a sequence of tasks, imposing a total ordering over , in addition to repeatedly solving Problem 1. The robot task sequencing problem can thus be formulated as follows.
Problem 2 (Robot task sequencing problem).
Find a permutation of the tasks , where is the set of possible task sequences, that minimizes the total path cost:
(3) |
such that the configuration at the end of and the start of are equal for all .
Problem 2 does not admit a tractable solution. For each task pose to be visited, there can be multiple valid configurations in set 111For infinite sets, as is the case for redundant arms, we produce a finite set by discretising around one of the free joints. A direct solution requires simultaneously choosing the optimal configuration from and sequencing the tasks. In other words, this case contains an instance of the generalised TSP (GTSP) [10] (Fig. 3b), which is even more complex than the standard TSP [33] (Fig. 3a), and does not allow for real-time planning. The number of possible sequences to evaluate is , where is the cardinality of the largest set of IK solutions for any task . Furthermore, evaluating the path cost for each configuration pair requires solving a motion planning problem, which is itself PSPACE-complete [34]. These computational complexities, which we wish to avoid, motivate our approach to solving Problem 2.
III-C Approach Overview
Reducing the set of IK solutions of each task to a unique solution transforms the GTSP in Problem 2 to a classical TSP, which is easier to solve. We therefore search for a mapping from each task in a discrete approximation of the full task space to a suitable unique IK solution .
To ensure that task sequencing using this mapping guarantees short, smooth and collision-free paths between tasks in both task and configuration space, the map is chosen to be an approximate isometry. Intuitively, an approximate isometry enforces that two tasks close in task space remain close in configuration space after mapping. Once is found, the GTSP in Problem 2 is successfully reduced to the classical TSP problem as desired, and task sequencing can be solved efficiently. As a result, the solution of the reduced problem is a near-optimal solution to Problem 1, producing smooth, short paths between tasks.
However, the kinematics of a robotic manipulator working in the task space may not necessarily admit a single approximate isometry . For example, in Fig. 2a there is no single that allows the arm to travel the short task-space distance required without taking a long path through configuration space. To handle such cases, we relax the constraint of enforcing a unique and consider a finite set of maps. Thus, we propose finding mappings from subspaces in task space to distinct subspaces in configuration space, i.e., . Within each subspace, the corresponding approximate isometry guarantees short, smooth and collision-free paths in both task and configuration space.
This effectively decomposes the task space into subspaces that may overlap, leading to cases where a single task is assigned multiple IK solutions rather than our single desired one. As such, the GTSP problem is no longer reduced immediately to a classical TSP one. To solve Problem 2 we must first disambiguate which IK solution to select in overlapping subspace regions. Then, we may solve a classical TSP problem within each subspace independently. The final reduced problem and approach is illustrated in Fig. 3c.
IV HAUSDORFF APPROXIMATION PLANNER FRAMEWORK





In this section we detail the HAP framework which consists of an offline pre-computation stage, and an online planning stage, see Fig. 4. In the pre-computation stage the map(s) and corresponding task space decompositions are generated as detailed in Sections IV-A and IV-B. Then, during online planning the online tasks are matched to the mapped subspaces, intra-subspace TSPs are solved independently, and the final motion is generated for execution. These online stages are described in Section IV-C.
IV-A Task-space Decomposition




Input: robot model , environment and poses
Output: maps and corresponding edges
Input: graph , root node
Output: minimum sum of path costs and
corresponding mappings
Input: Neighbouring node and expanded node mapping
Output: candidate mapping and resulting edge cost
Input: Queue , candidate mapping , neighbour node and expanded node
Output: updated path cost and updated IK assignment
The offline pre-computation stage begins with computation of the -GHA(s). We are given an anticipated environment and a set of tasks representative of online scenarios. We assume the environment is not entirely known in advance, but a general model is available that approximates what is expected. For example, might represent a general bookshelf structure including the shelves and case. However, need not include all objects within the bookshelf, as these details may be unknown a priori and discovered later.
An undirected graph is created with nodes corresponding to poses and edges formed by connecting nodes within a specified radius of each other. An example and is shown in Figs. 5a-LABEL:sub@fig:offline_edges. An -GHA is then generated from according to Alg. 1 and is represented as a subgraph of ; that is, where . An example subgraph representation is shown in Fig. 5c.
Algorithm 1 is initialised by assigning all nodes to . A node stays in until a unique IK solution is assigned. While is not empty, is found via a generate map algorithm procedure (Alg. 2). Algorithm 2 searches for a that minimizes the objective cost, the sum of all minimum cost paths from a root node to all other nodes. That is,
(4) |
where the cost of any path of nodes is defined as
(5) |
To ensure that paths have bounded lengths and do not involve large, unnecessary arm movements, is additionally constrained such that it is an approximate isometry, or an -Gromov-Hausdorff approximation (-GHA) [35], defined below.
Definition 1.
The map is an -Gromov-Hausdorff approximation if
(6) |
for some and metric on the task-space .
It should be noted that and operate on different metric spaces. However, this can be accounted for through appropriate choice of epsilon.
Depending on the value of , topology of and robot kinematic structure, some nodes may still have undefined mappings after a single iteration of the algorithm. It may then be necessary to search for multiple -GHAs, , and corresponding edges, , that map a covering set of subspaces to a set of disjoint configuration subspaces .
IV-B -GHA Computation
The generate map algorithm as outlined in Alg. 2 is based on Dijkstra’s algorithm and attempts to find a unique IK solution for each task in such that the objective cost in (4) is minimised. The process is visualised in Fig. 6. It begins by assigning an undefined mapping to all nodes except for the root node which is mapped arbitrarily to one of its IK solutions. The rest of the procedure is carried out as in the original Dijkstra’s algorithm with a priority queue [36], with modifications to the node expansion step where we compute the unique IK solution mapping. Here, the set of neighbouring nodes of , , is run through the functions shown in Algs. 3 and 4.
In get mapping (Alg. 3), if a node has already been assigned an IK solution , this solution and the edge cost,
(7) |
are returned and the -GHA is not updated. Otherwise, the IK solution that gives the minimum while satisfying the -GHA constraint in (6) is returned. The returned and are passed as a candidate to update (Alg. 4). In update, if the candidate path cost from root node to is less than the current cost then is mapped to , the path cost is updated, and an edge is created between and . Additionally, if is not in , it is added.
The above process is repeated for all IK solutions of the root node. If required, the algorithm is run times to find multiple -GHAs. The resulting one or more -GHA(s) that minimise are returned. All nodes are assigned an IK solution before being placed in the queue. It is also important to note that these assignments do not change during an iteration of the routine, as this could result in unstable behaviour and violation of the -GHA condition due to changing edge costs. However, path costs may change after finding shorter paths through .
In contrast to the original Dijkstra’s algorithm, all nodes are initialised with a non-infinite path cost . Thus, finding a small number of -GHAs with greater coverage will be favoured, particularly in earlier iterations.
IV-C Task Sequencing with -GHAs




With each offline task mapped to a unique or reduced set of IK solutions via or found offline, the online planner can solve a classical TSP as a proxy for solving the task sequencing problem in Problem 2. However, the set of online tasks provided may not necessarily align with the offline set used to generate the subspace mappings in the offline stage, as illustrated in Fig. 5d. As such, each task must first be assigned to one of the subspace mappings . This matching process and subsequent task sequencing is outlined in Alg. 5 and visualised in Fig. 7.
IV-C1 Matching online tasks to offline subspaces
Beginning with the single map case, to match an online task with a suitable task-space subspace we query the -closest offline tasks to according to task-space distance. For the set of -closest candidates, we retrieve their IK solutions assigned by , , and compare them pairwise to all possible IK solutions for task using a suitable similarity metric in configuration space. We use the -norm in this work. The pair of online/mapped task configurations that minimises this metric is selected as a match.
If multiple -GHAs were required in the offline stage to decompose the subspace, there may be an overlap, giving a set of suitable matches (one candidate per map) when following the procedure outlined for the single map case above. To disambiguate this, we choose the first match whose similarity value to falls below a given threshold. This reduces the number of checks needed, lowering computation time, and biases matches to subspaces found in earlier iterations, reducing the amount of subspace switching.
Once online tasks are matched, they are connected to the graph of their corresponding -GHA by adding the edge , see Fig. 7b. Then online tasks are grouped by equivalent subspace assignment and paths are computed pairwise between intra-subspace tasks using a graph search algorithm which can be computed cheaply using the fixed, unique IK solutions in .
IV-C2 Task sequencing via classical TSP
With online tasks grouped by subspace and intra-subspace paths generated, a classical TSP can be solved within each subspace. To facilitate moving between subspaces a home configuration for the robot is defined. The home configuration is chosen such that all subspaces may be reached via a straight-line path in configuration space. Thus, the home configuration acts as an intermediate point connecting all pairs of subspaces and can be used to connect start and goal poses in separate subspaces by simply joining the straight-line paths to and from it.
To solve the set of classical TSPs in each subspace, weighted adjacency matrices using the path costs are constructed to define TSP edge costs. Thus, each task group has an associated matrix where the weights correspond to the path cost for each pair of tasks within the group, including the home configuration. These matrices are used as input to a TSP solver, which returns a task sequence for each group independently. The TSP solver is constrained such that each sequence begins and ends at the home configuration. The sequences are concatenated in arbitrary order. This concatenation is always possible by construction of the sequences, which all start and end at the home configuration.
IV-C3 Path Post-Processing
The final online algorithmic step before a path sequence can be executed by the robot is to time-parameterise the paths and perform post-processing to ensure that they are smooth and time-continuous safe; that is, they are contained entirely within . We refer to this post-processing as trajectory adaptation.
There are a number of existing trajectory optimisation algorithms that are designed for similar purposes. In general, these algorithms require an initial seed trajectory as input, which they attempt to adapt to satisfy given constraints and maximise/minimise a given objective. In this work we can conveniently use the time-parameterised modified subspace path, , as the seed trajectory.
Unfortunately, trajectory optimisation approaches are not guaranteed to succeed in finding a solution and depend heavily on the choice of seed trajectory. The seed trajectory already accounts for obstacles known at the time of construction and is preferable to less informed choices, such as a straight-line trajectory in configuration space. However, a fallback method remains necessary in case of failure due to obstacles discovered or a task not lying within any subspace at execution time. In such an event, a probabilistically complete planner is used with the closest IK solution assignment, used as its goal configuration input. Probabilistically complete methods may still fail to find a solution in a reasonable amount of time. Thus, HAP enforces a user-defined threshold and terminates execution if exceeded. This is the only condition in which HAP fails to produce an executable trajectory.
IV-D Practical Considerations
IV-D1 Encouraging exploration
While searching for -GHA(s), it is beneficial to bias the search toward the unexplored region of the task space. To encourage subspace exploration in subsequent iterations of the routine, a penalty may be added to all edge costs passing through a node, where is a count of how many times a node is assigned an IK solution, and is a tunable parameter. As the penalties accumulate, previously mapped portions of the graph are not considered in later iterations of the algorithm as their path costs may exceed . The algorithm then focuses on previously unmapped nodes to increase coverage of .
IV-D2 Ensuring smooth transitions between subspaces
As previously mentioned, when moving between subspaces the arm first moves back to a fixed home configuration. Based on a given home pose, the corresponding IK solution that minimises the distance to the average configuration of the first found subspace are chosen. Note that the home configuration can be computed online allowing for flexible home pose choice.
To avoid large changes in configuration while returning to home, the subspaces are biased to be close to one other. For in Alg. 1 an additional penalty with user-defined weighting is added to the edge cost in (7). This way, chosen IK solutions are biased to be close in configuration space to . In addition, one can optionally enforce that the IK solution assignment for the root node is within some distance threshold, i.e., .
IV-D3 Balancing the number of subspaces
If many undefined node mappings remain after an iteration of Alg. 2, may not cover large regions of the task space. This may occur due to poor flexibility admitted by the robotic manipulator’s natural kinematic configurations (demonstrated in Fig. 14). This can have adverse impact on online planning if IK solutions of online tasks are far from mapped subspace configurations, leading to failures or jerky trajectories. As such, Alg. 1 terminates only when and a complete set of subspaces that fully cover the task space are found. Note that this condition may never be met. For example, a region requiring large configuration changes to switch to may have undefined mapping if a conservative is chosen.
In practice a large number of subspaces is undesirable as it can slow subspace matching during online planning. Furthermore, frequent subspace switching can add cumbersome overhead to online execution. Thus, to balance a trade-off between coverage and planning/execution time the main loop in Alg. 1 can be terminated once a user-defined maximum number of subspaces have been found or until the threshold cannot be satisfied. Alternatively, the loop can be terminated once a certain task-space coverage percentage has been achieved or when the size of the subspace found in an iteration falls below a set threshold.
IV-D4 Modifications for mobile bases
Greater flexibility in subspace assignment and larger workspaces can potentially be achieved by allowing the arm to be mobile. Having multiple -GHAs synergises well with a mobile manipulator. Instead of allocating an arbitrary number of -GHAs, one can choose a discrete number of base poses and assign -GHAs to each base pose.
When computing the task-space decomposition for a mobile base, the generate map algorithm in Alg. 2 is run for all base poses in each iteration in Alg. 1. The pose that yields the lowest objective cost is allocated a -GHA. This base pose is then removed as a candidate in the subsequent iterations. This is repeated until all base poses have been assigned a subspace or until .
For mobile base online execution, the subspace switching action consists of moving back to the home configuration before moving the base. Furthermore, when sequencing for the mobile base case we ignore the base movement cost when switching between subspaces. However, if this were important then sequencing the group execution order could be solved using another TSP with the base movement costs.
IV-D5 Task-space graph construction
An example of an undirected graph on is visualised in Fig. 5b, where nodes are tasks in and edges are connections between tasks. The construction strategy of such a graph is flexible, however there are a few important considerations to highlight. Firstly, greater edge connection density allows for more diverse paths and greater node density increases the probability of time continuous safety being met by the retrieved subspace paths, . Additionally, edges connect nodes in task space and hence a local connection strategy needs to be devised to ensure they are feasible in the configuration space. The connection strategy used in this paper is to connect nodes within a ball of specified radius in the workspace. To ensure feasibility, it is required that an IK solution in exists for a discrete set of points along the edge connecting two nodes.
The upon which the graph is built is a discretisation of the user-defined task space. In the context of this work, it represents approximate poses that the arm is expected to plan to. An example discretisation strategy is visualised in Fig. 5a. Poses here could represent abstract tasks such as pre-grasp points or camera viewpoints for active perception. The orientation of the poses in should align roughly with the expected tasks. For example, in Fig. 5a all poses point forward into the bookshelf, a suitable construction for tasks such as grasping and scene reconstruction. Notice in the online scenario in Fig. 5d the task poses need not lie exactly on . However, performance may decrease the greater this discrepancy is. While this is a suitable choice for the given environment our framework is perfectly capable of searching over task spaces with varying orientations as long as a valid task space distance metric is used, see sec V.
The poses in this work are generated procedurally by defining a uniform graph of nodes across a volume bounding the bookshelf; however, there exists many possible methods for generating these poses. For example, the manipulator could be teleoperated to various poses or the manipulator could be moved kinesthetically. That is, the human operator could move the end effector directly and store the poses. However, care should be taken such that no islands are formed in the graph. For example, in the bookshelf scenario there is a plane of poses in front of the bookshelf to ensure that there is connectivity between poses within the shelves. However, this could potentially be resolved in a post-processing step automatically, relieving the burden on the operator.
V ANALYSIS
In this section, we show that the paths found by Alg. 1 have bounded lengths and are hence efficient and free of jerky motion. This is because, as we show, -GHAs approximately preserve shortest paths between metric spaces, in our case the task and configuration spaces. We first verify that the map found by Alg. 1 is indeed an -GHA (definition. 1).
Theorem 1 ( is an -GHA).
found by Alg. 2 is an -GHA.
Proof.
Pick any . Then , by construction, we have
for some . Then, , i.e. the next-nearest neighbours of , we again have by construction
Similarly for all th and th nearest neighbours of ,
Then, using the triangle inequality we get
As is arbitrary, taking to be gives the required result. ∎
Furthermore, maps shortest paths in the workspace to paths in configuration space that are of bounded length. That is, minimising geodesics are approximately preserved under the mapping. Intuitively, minimising geodesics (referred to henceforth as geodesics for brevity) are a generalisation of “straight lines”, or shortest paths, in Euclidean space to more general spaces, defined below.
A metric space is a set equipped with a metric, or “distance function”, that satisfies the axioms of positiveness, symmetry, and triangular inequality [37]. Drawing upon concepts from metric geometry, we characterise geodesics on metric spaces as paths whose segment lengths sum to that of the whole path length. Formally,
Definition 2 (Geodesics).
Given a metric space with intrinsic metric , a path is a geodesic iff:
(8) |
for any ordered with first and last entries equal to and , respectively.
We now show that an -GHA, and thus found by HAP, preserves geodesics approximately.
Theorem 2 (-GHAs preserve geodesics).
Let and be two metric spaces, and an -GHA. Then, for any geodesic on , we have
(9) |
In other words, the path is away from being a geodesic in the configuration space.
Proof.
Applying the -GHA condition to the end-points of , we have
Because is a geodesic, we can replace the term above with the sum of lengths along any test points ,
Using the -GHA condition on summands individually, we have
arises because there are epsilons inside the sum and one outside. ∎
VI EXPERIMENTS








This section presents several sets of experimental results that demonstrate and evaluate HAP’s performance in a complex simulated bookshelf environment using robot manipulators with varying kinematic models. For comparison, we also present results obtained using state-of-the-art task sequencing methods.
VI-A Experimental Setup
Experiments consist of sets of randomised trials where tasks are sampled uniformly at random from the environment’s task space. The number of tasks range from 5 to 30 and for each setting we run 50 trials to gauge the robustness of each method.
We compare HAP with competitive contemporary RTSP solver baselines. Both methods compute a sequence of goal IK solutions and then use the same trajectory adaption process as HAP, except with a straight-line trajectory prior for the trajectory optimisation planner:
-
•
RoboTSP [2]: Initially solves a TSP in task space. Given this sequence, an optimal joint configuration is assigned to each task using a graph search algorithm such that the total path length (Euclidean distance in configuration space) through each configuration is minimised.
-
•
Cluster-RTSP [4]: Begins by assigning a unique configuration to each task based on a best-fit heuristic. This essentially tries to choose a set of configurations that are all close to each other. The configurations are then clustered into similar groups, based on proximity in configuration space. A configuration sequence is then found by solving inter-cluster and intra-cluster TSPs individually.
The following metrics are evaluated:
-
•
Planning success rate refers to the percentage of tasks for which the trajectory adaption process succeeded in motion planning a trajectory in .
-
•
Motion planning time refers to the total computation time taken for the trajectory adaption process to compute motion plans for all tasks.
-
•
Average execution time refers to the average time taken per task for a successful trajectory execution, assuming the arms are operating at their maximum joint velocities. Note that for HAP we count inter-subspace trajectories, that is the transition to and from the home configuration, as one task.
-
•
Maximum trajectory jerk refers to the maximum joint jerk norm of an executed trajectory. This is computed numerically using the finite difference method.
- •
The robot models used are a 7-DOF Rethink Robotics Sawyer and a 6-DOF Universal Robots UR5. The UR5 also has the option to be mobile, which we refer to as HAP-Mobile. We additionally include a variant of HAP which, similar to RoboTSP and Cluster-RTSP, utilises a straight-line trajectory prior for trajectory optimisation, referred to as HAP-no-prior.
VI-B Implementation Details
In implementing Alg. 1, the number of root nodes, . The maximum number of -GHAs was set to for the UR5 experiments. Sawyer experiments only utilised a single -GHA due the flexibility in IK solutions afforded by its kinematic redundancy. In implementing Algs. 2-4, all nodes are initialised with path cost . The subspace exploration penalty . The subspace distance biasing penalty . Experiments with UR5 model use , and those with Sawyer model use . Distance is defined as , and as . Both metrics use uniformly weighted distances.
For the online planner (Alg. 5), the number of closest neighbours used when retrieving is . The threshold used for terminating the search over mappings when matching a task configuration is distance . Google’s or-tools [38] package is used as the TSP-solver in (3).
The discretised task space, , used is shown in Fig. 5a. The home pose used is shown in Fig. 5d. For the mobile base experiments, a discrete set of possible base positions is defined uniformly along the -axis, parallel to the bookshelf, see Fig. 16.
The trajectory optimisation algorithm we use for online adaption is TrajOpt with default implementation from [39]. The fallback probabilistic method used is BIT* with a timeout limit of 2 seconds and otherwise default implementation from [40].
The simulation environment used is OpenRAVE with IKFast kinematics solver [41]. To generate a finite set of IK solutions for the 7-DOF Sawyer, IKFast sets the second DOF as a free joint with discretisation increments of radians.
VI-C Results
Time benchmarks for the Sawyer and UR5 bookshelf experiments are shown in Figs. 8 and 9. Average maximum trajectory jerk values are shown in Tables II and II.
The box-and-whisker plots in Fig. 10 show that HAP variants achieved favourable success rate relative to baseline methods. Notably, the UR5 benefits from subspace trajectory priors more so than the Sawyer which is able to utilise its kinematic redundancy to better navigate around obstacles.
Motion planning times for HAP variants in the UR5 experiments greatly outperform benchmarks with approximately up to 3x speedup compared to robotsp and 2x compared to cluster-RTSP with consistently higher planning success rates and whilst retaining similar task sequencing time scaling. For a plan to fail, both TrajOpt and BIT* must timeout. Thus, low planning success rates explain the higher motion planning times exhibited by the baseline methods.
HAP variants and Cluster-RTSP saw a downward trend in execution times as the number of tasks increased for both experiments, whereas RoboTSP’s fluctuated for the UR5 case. Whilst HAP’s execution times were similar to Cluster-RTSP, and RoboTSP in the case of Sawyer experiments, the average maximum trajectory jerk values in Tables II and II were up to approximately 5x lower with low variance. It should be noted that trajectory execution times describe successful trials only and should be interpreted in conjunction with corresponding planning success rates.
Furthermore, the HAP-mobile variant achieved comparable results to the static case, confirming HAP’s ability to generalise to mobile bases. Interestingly, the mobile and static variants utilised on average 2.45 and 1.9 subspaces per trial, respectively. This can be explained by the greater subspace coverage and diversity provided by the mobile base (see Fig. 15), hence the slightly better planning and success rates.
Total offline-computation time was 108s, 318s and 569s for the UR5, Sawyer and UR5 with mobile base, respectively. It should be noted, however, that this could be substantially sped up through various optimisations such as parallelisation of the candidate -GHA map search (Alg. 1 lines 8-14) and IK solution computation.
VI-D Discussion



















In this section we discuss the experimental results and provide an analysis on HAP’s performance compared to the baselines. A key benefit of HAP is its ability to effectively reason about low-level motion during task sequencing. A notable supporting observation of this is that HAP’s task sequences tended to minimise movement between bookshelf rows. This is in contrast to the baselines which ignore the cost of avoiding collision with the shelves and objects, leading to frequent switching between rows and resulting in inefficient trajectory sequences and higher planning failure rates. See Appendix -C for supplementary videos with example experiments.
More specifically to RoboTSP, its decoupled sequencing approach fails to reason about the non-linear relationship between task space and configuration space; that is, short paths in task space are not necessarily so in configuration space. This is evidenced in the execution time plot for the UR5 experiments (Fig. 9b) where it is expected that average execution times should decrease as the number of tasks increase due to the increasing spatial density of the tasks; however, the opposite is observed for RoboTSP. An example consequential behaviour is depicted in Fig. 11 where unnecessarily long trajectories are executed.
Cluster-RTSP performs overall better than RoboTSP in the UR5 experiments. Compared to HAP, however, trajectory jerks and planning time and success rates were overall worse. A contributor of this, as earlier claimed, is that outlier tasks with highly dissimilar IK solutions can have an overall negative impact on the trajectory sequence, as depicted in Fig. 12. This can be explained by the initial unique configuration assignment step which attempts to find configurations that are all close to each other.
In contrast, the -GHAs computed by HAP account for nonlinearities by considering prior knowledge such as the manipulator’s kinematic structure and environment obstacles. This is exemplified in Fig. 13 where trajectories between intra-subspace tasks appear to be consistently short and smooth. Furthermore, tasks requiring a large change in configuration are grouped into the same subspace and executed together without negatively affecting other tasks in the sequence.
Enabling the base of the UR5 robot to be mobile further enhanced performance due to the greater flexibility afforded by the diverse subspace assignments (see Figs. 15-16). Emergent behaviour such as translating the base away from poses in the lower shelf in order to avoid self-collision were observed. See Appendix -C for a supplementary video demonstrating this.
While the above effects are less pronounced in the Sawyer experiments due to its kinematic redundancy (see Fig. 14), Cluster-RTSP’s performance was notably worse than RoboTSP and HAP. This can be explained by the algorithm’s inability to effectively reason over the larger number of redundant IK solutions afforded by the arm’s extra DOF. Similar findings were reported in the original paper [4].
Finally, one may suspect that HAP produces similar goal configurations to the baselines and the seed trajectories retrieved from the -GHA mappings led to higher success rates. However, we elucidate this claim by showing that HAP-no-prior still performs markedly better even without informed trajectory priors.
VII CONCLUSIONS AND FUTURE WORK
We have presented a new multi-query task sequencing framework for robotic manipulators that is designed to perform efficiently in practice given a user-defined task space. The framework computes a task-space decomposition that quickly produces efficient task sequences and motion plans online. The decomposition is constructed by finding a set of subspaces with associated -Gromov-Hausdorff approximations that guarantee short paths of bounded length which also can be concatenated smoothly.
We present theoretical analyses and extensive empirical evaluations. We evaluate our framework with several kinematic configurations over long task sequences in a complex bookshelf environment. Results showed notable performance improvement over state-of-the-art baseline methods in planning time, planning success rate, and smoothness measured by jerk. This highlights the importance of reasoning about the low-level motion of the manipulator during sequencing which HAP facilitates in a computationally efficient manner.
VII-A Limitations
Here we discuss limitations of our framework and the current implementation. By reducing the search space of the planner, we intentionally trade off flexibility in the range of solutions for computation speed. However, this may lead to pruning of potentially optimal solutions. One has some control over this by, for example, utilising an increasing number of redundant -GHAs to cover more of the configuration space. In the limit the full solution space can be recovered.
Furthermore, the -GHA objective in (4) is a combination of task-space coverage and degree-of-path preservation which is not directly related to the task sequencing objective; the total sequence cost. Thus, it is difficult to draw any guarantees on the overall path sequence optimality. One potential work around is to store a larger number of subspaces with varying coverage of the configuration space and select a subset of these based on the online scenario.
The online planning process additionally introduces suboptimality to the overall sequence cost. For example, tasks are assigned greedily to a subspace, subspace groups are executed in arbitrary order, intra-subspace sequences are subject to the suboptimality bounds of the TSP solver and the utilisation of a fixed home configuration for transitioning between subspaces. We chose these as they were straight-forward implementations and in practice performed well in our problem setting. In general, we envision many potential approaches to utilising the -GHA mappings and our online planning method is just one such approach rather than a fundamental component of the framework.
VII-B Future Work
Our results and limitations discussed above motivate several important avenues of future work. For example, formulating the -GHA objective in a way that directly considers the task sequence objective would be an interesting extension. Regarding the current implementation, HAP consists of several hyperparameters that may be cumbersome to tune. Automatic tuning of these could help improve usability. For example, one could train a learning model to predict based on the robot model, task space and environment.
It would be interesting to explore methods that would adapt the subspaces online in response to changes in the environment, potentially using online domain adaptation techniques [44] and conditional density estimation techniques [45]. While we focus on task sequencing in this work, -GHAs are potentially useful for other applications. For example, local reactive controllers such as RMPflow [46] would benefit from knowledge of which regions of the task space are approximate isomorphisms to configuration space.
Another interesting avenue of future work is to compute the maps using a continuous representation, for example a Gaussian process, while maintaining the bounded suboptimality guarantees. Additionally, applying HAP to other embodiments such as high-DOF humanoids presents interesting challenges.
References
- [1] S. Alatartsev, S. Stellmacher, and F. Ortmeier, “Robotic task sequencing problem: A survey,” Journal of intelligent & robotic systems, vol. 80, no. 2, pp. 279–298, 2015.
- [2] F. Suárez-Ruiz, T. S. Lembono, and Q.-C. Pham, “Robotsp–a fast solution to the robotic task sequencing problem,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), 2018, pp. 1611–1616.
- [3] D. Li, Q. Wang, W. Zou, H. Su, X. Wang, and X. Xu, “An efficient approach for solving robotic task sequencing problems considering spatial constraint,” in Proc. of IEEE International Conference on Automation Science and Engineering (CASE), 2022, pp. 60–66.
- [4] C. Wong, C. Mineo, E. Yang, X.-T. Yan, and D. Gu, “A novel clustering-based algorithm for solving spatially constrained robotic task sequencing problems,” IEEE/ASME Transactions on Mechatronics, vol. 26, no. 5, pp. 2294–2305, 2020.
- [5] W. Jing, J. Polden, P. Y. Tao, C. F. Goh, W. Lin, and K. Shimada, “Model-based coverage motion planning for industrial 3d shape inspection applications,” in Proc. of IEEE Conference on Automation Science and Engineering (CASE), 2017, pp. 1293–1300.
- [6] S. S. Srinivasa, D. Berenson, M. Cakmak, A. Collet, M. R. Dogar, A. D. Dragan, R. A. Knepper, T. Niemueller, K. Strabala, M. V. Weghe et al., “Herb 2.0: Lessons learned from developing a mobile manipulator for the home,” Proc. of IEEE, vol. 100, no. 8, pp. 2410–2428, 2012.
- [7] M. R. Dogar, K. Hsiao†, M. Ciocarlie†, and S. S. Srinivasa, “Physics-based grasp planning through clutter,” in Proc. of Robotics: Science and Systems (RSS), 2013.
- [8] D. Morrison, A. W. Tow, M. Mctaggart, R. Smith, N. Kelly-Boxall, S. Wade-Mccue, J. Erskine, R. Grinover, A. Gurman, T. Hunn et al., “Cartman: The low-cost cartesian manipulator that won the amazon robotics challenge,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), 2018, pp. 7757–7764.
- [9] L. E. Kavraki, P. Svestka, J.-C. Latombe, and M. H. Overmars, “Probabilistic roadmaps for path planning in high-dimensional configuration spaces,” IEEE Transactions on Robotics and Automation, vol. 12, no. 4, pp. 566–580, 1996.
- [10] C. E. Noon and J. C. Bean, “An efficient transformation of the generalized traveling salesman problem,” INFOR: Information Systems and Operational Research, vol. 31, no. 1, pp. 39–44, 1993.
- [11] P. T. Zacharia and N. Aspragathos, “Optimal robot task scheduling based on genetic algorithms,” Robotics and Computer-Integrated Manufacturing, vol. 21, no. 1, pp. 67–79, 2005.
- [12] E. Kolakowska, S. F. Smith, and M. Kristiansen, “Constraint optimization model of a scheduling problem for a robotic arm in automatic systems,” Robotics and Autonomous Systems, vol. 62, no. 2, pp. 267–280, 2014.
- [13] S. L. Villumsen and M. Kristiansen, “A framework for task sequencing for redundant robotic remote laser processing equipment based on redundancy space sampling,” Procedia Manufacturing, vol. 11, pp. 1826–1836, 2017.
- [14] A. Silwal, J. R. Davidson, M. Karkee, C. Mo, Q. Zhang, and K. Lewis, “Design, integration, and field evaluation of a robotic apple harvester,” Journal of Field Robotics, 2017.
- [15] C. W. Bac, J. Hemming, B. Tuijl, R. Barth, E. Wais, and E. J. Henten, “Performance evaluation of a harvesting robot for sweet pepper,” Journal of Field Robotics, vol. 34, no. 6, pp. 1123–1139, 2017.
- [16] A. You, F. Sukkar, R. Fitch, M. Karkee, and J. R. Davidson, “An efficient planning and control framework for pruning fruit trees,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), 2020, pp. 3930–3936.
- [17] X. Dong, G. Wan, P. Zeng, C. Song, and S. Cui, “Optimizing robotic task sequencing and trajectory planning on the basis of deep reinforcement learning,” Biomimetics, vol. 9, no. 1, p. 10, 2023.
- [18] Q.-N. Nguyen, N. Adrian, and Q.-C. Pham, “Task-space clustering for mobile manipulator task sequencing,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), 2023, pp. 3693–3699.
- [19] S. N. Spitz and A. A. Requicha, “Multiple-goals path planning for coordinate measuring machines,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), vol. 3, 2000, pp. 2322–2327.
- [20] P. T. Zacharia, E. K. Xidias, and N. A. Aspragathos, “Task scheduling and motion planning for an industrial manipulator,” Robotics and computer-integrated manufacturing, vol. 29, no. 6, pp. 449–462, 2013.
- [21] A. Kovács, “Integrated task sequencing and path planning for robotic remote laser welding,” International Journal of Production Research, vol. 54, no. 4, pp. 1210–1224, 2016.
- [22] M. Zucker, N. Ratliff, A. D. Dragan, M. Pivtoraiko, M. Klingensmith, C. M. Dellin, J. A. Bagnell, and S. S. Srinivasa, “CHOMP: Covariant hamiltonian optimization for motion planning,” International Journal of Robotics Research, vol. 32, no. 9-10, pp. 1164–1193, 2013.
- [23] J. Schulman, Y. Duan, J. Ho, A. Lee, I. Awwal, H. Bradlow, J. Pan, S. Patil, K. Goldberg, and P. Abbeel, “Motion planning with sequential convex optimization and convex collision checking,” International Journal of Robotics Research, vol. 33, no. 9, pp. 1251–1270, 2014.
- [24] C. R. Garrett, R. Chitnis, R. Holladay, B. Kim, T. Silver, L. P. Kaelbling, and T. Lozano-Pérez, “Integrated task and motion planning,” Annual review of control, robotics, and autonomous systems, vol. 4, no. 1, pp. 265–293, 2021.
- [25] T. Siméon, J.-P. Laumond, J. Cortés, and A. Sahbani, “Manipulation planning with probabilistic roadmaps,” The International Journal of Robotics Research, vol. 23, no. 7-8, pp. 729–746, 2004.
- [26] L.-P. Ellekilde and H. G. Petersen, “Motion planning efficient trajectories for industrial bin-picking,” International Journal of Robotics Research, vol. 32, no. 9-10, pp. 991–1004, 2013.
- [27] J. J. H. Lee, K. Frey, R. Fitch, and S. Sukkarieh, “Fast path planning for precision weeding,” in Proc. of Australasian Conference of Robotics and Automation (ACRA), 2014.
- [28] Y.-C. Lin and D. Berenson, “Using previous experience for humanoid navigation planning,” in Proc. of IEEE International Conference on Humanoid Robots (Humanoids)), 2016, pp. 794–801.
- [29] W. Reid, R. Fitch, A. H. Göktoğan, and S. Sukkarieh, “Sampling-based hierarchical motion planning for a reconfigurable wheel-on-leg planetary analogue exploration rover,” Journal of Field Robotics, vol. 37, no. 5, pp. 786–811, 2020.
- [30] C. Chamzas, Z. Kingston, C. Quintero-Peña, A. Shrivastava, and L. E. Kavraki, “Learning sampling distributions using local 3d workspace decompositions for motion planning in high dimensions,” in Proc. of IEEE International Conference on Robotics and Automation (ICRA), 2021, pp. 1283–1289.
- [31] M. Hassan and D. Liu, “Simultaneous area partitioning and allocation for complete coverage by multiple autonomous industrial robots,” Autonomous Robots, vol. 41, no. 8, pp. 1609–1628, 2017.
- [32] F. Paus, P. Kaiser, N. Vahrenkamp, and T. Asfour, “A combined approach for robot placement and coverage path planning for mobile manipulation,” in Proc. of IEEE/RSJ International conference on intelligent robots and systems (IROS), 2017, pp. 6285–6292.
- [33] R. Matai, S. P. Singh, and M. L. Mittal, “Traveling salesman problem: an overview of applications, formulations, and solution approaches,” Traveling salesman problem, theory and applications, vol. 1, no. 1, pp. 1–25, 2010.
- [34] J. Canny, The complexity of robot motion planning. MIT press, 1988.
- [35] M. T. A. Jaramillo, The Structure of Fundamental Groups of Smooth Metric Measure Spaces. University of California, Santa Barbara, 2014.
- [36] M. Barbehenn, “A note on the complexity of Dijkstra’s algorithm for graphs with weighted vertices,” IEEE Transactions on Computers, vol. 47, no. 2, p. 263, 1998.
- [37] D. Burago, I. D. Burago, Y. Burago, S. Ivanov, S. V. Ivanov, and S. A. Ivanov, A course in metric geometry. American Mathematical Society, 2001, vol. 33.
- [38] Google, “Solving TSPs with OR-Tools,” 2017. [Online]. Available: https://developers.google.com/optimization/routing/tsp/tsp
- [39] P. Velagapudi, M. Koval, and J. King, “or_trajopt,” September 2016. [Online]. Available: https://github.com/personalrobotics/or_trajopt
- [40] M. Koval, C. Dellin, and M. Klingensmith, “or_ompl,” September 2016. [Online]. Available: https://github.com/personalrobotics/or_ompl
- [41] R. Diankov and J. Kuffner, “Openrave: A planning architecture for autonomous robotics,” Robotics Institute, Pittsburgh, PA, vol. 79, 2008.
- [42] F. S. Ruiz, “Robotsp: Robotic task sequencing problem,” 2018. [Online]. Available: https://github.com/crigroup/robotsp
- [43] C. Wong, “Cluster-rtsp,” 2021. [Online]. Available: https://github.com/Cuebong/Cluster-RTSP
- [44] A. Tompkins, R. Senanayake, and F. Ramos, “Online domain adaptation for occupancy mapping,” in Proc. of Robotics: Science and Systems (RSS), 2020.
- [45] W. Zhi, T. Lai, L. Ott, and F. Ramos, “Trajectory generation in new environments from past experiences,” in Proc. of IEEE/RSJ International conference on intelligent robots and systems (IROS), 2021.
- [46] C.-A. Cheng, M. Mukadam, J. Issac, S. Birchfield, D. Fox, B. Boots, and N. Ratliff, “Rmpflow: A geometric framework for generation of multitask motion policies,” IEEE Transactions on Automation Science and Engineering, 2021.
-C Multimedia
This article includes videos showcasing example task sequences generated by our method, HAP, and baselines, RoboTSP and Cluster-RTSP. UR5 bookshelf experiments are shown in the video titled “Supplementary Video 1”. Sawyer bookshelf experiments are shown in the video titled “Supplementary Video 2”.
-D Notation
Configuration space of the robot. | |
Task space of the robot (set of valid end-effector poses in ). | |
Discretised task space used to compute -GHAs. | |
A task (6D pose in ). | |
Set of online tasks. | |
Robot model. | |
A robot configuration. | |
Set of valid IK solution for task . | |
Approximate model of environment obstacles (offline). | |
Path of robot (sequence of configurations). | |
Set of all possible paths between two tasks (due to multiple IK solutions per task). | |
Configuration space distance metric. | |
Task space distance metric. | |
Denotes a unique mapping from task to configuration space. | |
Undirected graph used for computing -GHAs (constructed from and | |
Edges formed between nodes based on neighbouring distance condition, e.g. within specific radius. | |
-GHAs are subgraphs of and consist of and corresponding edges . | |
Subset of tasks in without an assigned mapping in any . | |
Minimum cost path between two tasks given . | |
Optimisation objective for computing |
-E HAP Task-space Decomposition for Bookshelf Experiments
Here, illustrations of HAP’s subspace allocation process are shown. In Fig. 14, a visualisation of the 7-DOF Sawyer arm’s naturally extended task-space coverage compared to the 6-DOF UR5 model is shown. This increased task-space coverage is due to the redundant kinematic configuration of the 7-DOF arm.
In Figs. 15LABEL:sub@fig:ur5_subspace1-LABEL:sub@fig:ur5_subspace5 each visualisation shows a new subspace found in an iteration of Alg. 2 for the UR5 with base mobility disabled. With each iteration, the overall coverage of is increased. Overlap between subspaces in task space is beneficial as it provides additional IK solutions to choose from during online planning. Subspaces found for the UR5 with base mobility now enabled are visualised in Figs. 16LABEL:sub@fig:ur5_mobile_subspace1-LABEL:sub@fig:ur5_mobile_subspace5 in the order they are generated by HAP. Subspace boundaries are not always obvious and would be difficult to generate manually.











