Open access peer-reviewed chapter

Multi-Path Planning on a Sphere with LMI-Based Collision Avoidance

Written By

Innocent Okoloko

Submitted: 16 May 2017 Reviewed: 22 September 2017 Published: 26 September 2018

DOI: 10.5772/intechopen.71216

From the Edited Volume

Advanced Path Planning for Mobile Entities

Edited by Rastislav Róka

Chapter metrics overview

1,156 Chapter Downloads

View Full Metrics

Abstract

The problem of path planning with collision avoidance for autonomous flying vehicles will become more critical as the density of such vehicles increase in the skies. Global aerial navigation paths can be modeled as a path-planning problem on a unit sphere. In this work, we apply consensus theory and semidefinite programming to constrained multi-path planning with collision avoidance for a team of communicating vehicles navigating on a sphere. Based on their communication graph, each vehicle individually synthesizes a time-varying Laplacian-like matrix which drives each of them from their initial positions to consensus positions on the surface of the sphere. The solution trajectories obtained on the unit sphere are transformed back to actual vehicle coordinates. Formation configurations are realized via consensus theory, while collision avoidance is realized via semidefinite programming. A Lyapunov-based stability analysis is also provided, together with simulation results to demonstrate the effectiveness of the approach.

Keywords

  • consensus
  • path planning
  • avoidance
  • optimization
  • LMI

1. Introduction

In this chapter, we present an approach to constrained multi-agent control on the unit sphere; by applying consensus theory and constrained attitude control (CAC) via semidefinite programming. Global navigation can be modeled by control on the unit sphere and such algorithms have applications in: aerial navigation [1]; sea navigation and ocean sampling [2]; space navigation and satellite cluster positioning [3, 4]. For example, the algorithm presented in this chapter will find practical application in aircraft horizontal separation.

Most path-planning work generally focus on two-dimensional (2D) [5, 6], and three- dimensional motion planning (3D) [7, 8, 9, 10]. However, both path planning models are limited when the motion is constrained to evolve on a sphere.

Looking at the main works that have been done on control on a sphere, [11] applied Lie algebra to develop a model of self-propelled particles (as point masses) which move on the surface of a unit sphere at constant speed. Circular formations of steady motions of the particles around a fixed small circle on the sphere were identified as relative equilibria of the model using a Lie group representation. The paper also provided mathematically justified shape control laws that stabilize the set of circular formations. They also proposed a shape control to isolate circular formations of particles with symmetric spacing by using Laplacian control. Further work on this is presented in [12].

The works [11, 12] are based on [5, 13], where a geometric approach to the gyroscopic control of vehicle motion in planar and three-dimensional particle models was developed for formation acquisition and control with collision avoidance in free space. They discovered three possible types of relative equilibria for their unconstrained gyroscopic control system on SE3: (i) parallel particle motion with arbitrary spacing; (ii) circular particle motion that has a common radius, axis and direction of rotation, and arbitrary along-axis spacing; (iii) helical particle motion that has a common radius, axis and direction of rotation, along-axis speed (pitch) and arbitrary along-axis spacing. This approach is effective in formation control of multiple systems in unconstrained spaces and for formations that conform to the three types of relative equilibria described above.

Therefore, it is necessary to consider consensus on a sphere, which can be applied to the more general motion control problem involving: (i) constrained spaces which contain static obstacles such as clutter; (ii) speed constrained vehicles; (iii) other arbitrary formations which are different from the relative equilibria described above. We apply consensus theory to collective motion of a team of communicating vehicles on the sphere and the concept of constrained attitude control (CAC) to generate collision avoidance behavior among the vehicles as they navigate to arbitrary formations [14].

We assume that each individual vehicle can communicate with neighbors within its sensor view. Each vehicle can therefore use the Laplacian matrix of the communication graph L in a semidefinite program to plan consensus trajectories on the sphere. Then the concept of CAC is used to incorporate collision avoidance, by maintaining specified minimum angles between vectors of vehicle positions. The algorithm presented here is applicable to motion control in both constrained and unconstrained spaces on the sphere, e.g. for planning consensus trajectories around static obstacles or adversarial non-cooperative obstacles on the sphere. The approach can also be applied to constrained vehicle motion of non-constant velocities. It is also possible to generate formations on the sphere that are different from circular motion.

The rest of this chapter is organized as follows. In Section 2, we present the mathematical basis of consensus theory, while the problem statement is presented Section 3. In Section 4, the solution and convergence analysis are presented. This is followed by simulation results in Section 5 and references in Section 6. Table 1 lists frequently used notation in this chapter.

NotationMeaning
nNumber of vehicles
iVehicle number i
xiPosition vector of vehicle i
x̂Unit vector corresponding to vector x
ui,ẋiControl input of vehicle i
xobsjObstacle vector number j
xijoffOffset vector between vehicles i and j
φijAngle between vehicle i and obstacle j
θijAngle between vehicles i and j
αiMinimum angular separation from obstacle number i
βijMinimum angular separation between vehicles i and j
xStacked vector of n position vectors
u,ẋStacked vector of n control inputs
LLaplacian matrix, L=DGAG
L,LiLaplacian-like stochastic matrix
0A vector consisting of all zeros
Kronecker multiplication operator
SE3Special Euclidean group
SmThe set of m×m positive definite matrices
InThe n×n identity matrix
ΛA positive definite matrix variable, ΛSm
CThe consensus space for x,C=xx1=x2==xn
GGraph
VSet of vertices of G
ESet of edges of G
viVertex viV
vivjEndpoint or edge vivjE
NiNeighbors of vi; Ni=vjV:vivjE
AGAdjacency matrix of G; AG=aij
DGOut-degree matrix of G; DG=dij
SA vector or matrix in the Schur’s inequality
RA positive definite matrix in the Schur’s inequality
QA symmetric matrix in the Schur’s inequality
MA positive definite matrix variable
GA positive semidefinite matrix

Table 1.

Frequently used notation in this chapter.

Advertisement

2. Mathematical background

This section briefly describes the mathematical basis of consensus theory.

2.1. Basic graph theory

We define a graph G as a pair VE consisting of two finite sets having elements; a set of points called vertices V=12n, and a set of connecting lines called edges, Evivj:vivjVji or endpoints, Eij or vivj, of the vertices [15]. Thus, an edge is incident with vertices vi and vj. Graph G is said to be undirected if for every edge connecting two vertices, communication between the vertices is possible in both directions across the edge, i.e. vivjE implies vjviE; otherwise it is called a directed graph (digraph), and it is symmetric. The quantity V is called the order, and E the size, respectively, of G. The set of neighbors of node vi is denoted by Ni=vjV:vivjE. The number of edges incident with vertex v is called the degree or valence of v. Furthermore, the number of directed edges incident into v is called the In-degree of v, while the Out-degree is similarly defined as the number of edges incident out of the v.

We define the adjacency matrix AG=aij of G of order n as the n×n matrix

aij=1ifeijE0otherwiseE1

For the undirected graph AG is always symmetric, while AG of a digraph G is symmetric if and only if G is symmetric. The out-degree matrix DG=dij of G of order n, is an n×n matrix

dii=ijaij,E2

which is simply the diagonal matrix with each diagonal element equal to the out-degree of the corresponding vertex. The in-degree matrix of G is similarly defined.

The Laplacian matrix L=lij of digraph G of order n, is the n×n matrix

L=DGAGE3

An important property of any Laplacian L is that its rows and columns, sum to zero.

2.2. Basic consensus theory

The basic consensus problem is that of driving the states of a team of communicating agents to an agreed state, using distributed protocols based on their communication graph. In this framework, the agents (or vehicles) ii=1n are represented by vertices of the graph, while the edges of the graph represent communication links between them. Let xi denote the state of a vehicle i and x is the stacked vector of the states all vehicles in the team. For systems modeled by first-order dynamics, the following first-order consensus protocol (or its variants) has been proposed, e.g. [16, 17]

ẋt=Lxtxoff.E4

We determine that consensus has been achieved when xixjxijoff as t, ij. A more comprehensive presentation of the necessary mathematical tools for this work (including graph theory and consensus theory), can be found in [18].

Advertisement

3. Problem statement

We state the problem of constrained motion on a unit sphere as follows: given a set of communicating vehicles randomly positioned on a unit sphere, with initial positions xit0R3, i=1,,n (referenced to a coordinate frame centered on the centroid of the sphere), a set of obstacles xobsjR3, j=1,,m, and the Laplacian matrix of their communication graph L, find a sequence of collision-free consensus trajectories along the surface of the unit sphere. In this development, a vehicle is modeled as a point mass.

The problem is illustrated in Figure 1; the unit sphere is centered on 0 which implies that vectors xi and xobsj are unit vectors and must be kept so throughout the evolution of the trajectory vectors. The angle between the position vectors of vehicles i and j is θij, while φik is the angle between vehicle i and obstacle k. The control problem is to drive all xi to a consensus position or to a formation while avoiding each other and the xobsj along the way on the unit sphere. From the solution trajectories, obtained as unit vectors, the actual desired vehicle trajectories are recovered via scalar multiplication and coordinate transformation.

Figure 1.

Constrained position control on a unit sphere.

There are two parts to the problem: consensus and collision avoidance. The consensus part is that of incorporating consensus behavior into the team on the unit sphere, which can lead to collective motion such as rendezvous, platooning, swarming and other formations. The second part which is collision avoidance, is resolved by applying constrained attitude control (CAC). The solutions are presented in the next section.

Advertisement

4. Solutions

We develop a solution that incorporates four steps: (i) synthesis of position consensus on the unit sphere; (ii) formulation of CAC based collision avoidance on the unit sphere; (iii) formulation of formation control on the unit sphere; (iv) consensus-based collision-free arbitrary reconfigurations on the unit sphere.

4.1. Synthesis of position consensus on the unit sphere

The basic consensus protocol Eq. (4) on its own does not solve the consensus problem on a sphere; neither does it solve the collision avoidance problem in adversarial situations (when there is opposing motion and static obstacles). To incorporate consensus on a unit sphere, we follow an optimization approach, by coding requirements as a set of linear matrix inequalities (LMI) and solving for consensus trajectories on the sphere. The main problem at this stage is to find a feasible sequence of consensus trajectories for each vehicle on the sphere, which satisfies norm and avoidance constraints. For this purpose, rather than state the objective function as a minimization or maximization problem (as usual in optimization problems), we state the objective function as the discrete time version of a semidefinite consensus dynamics, which will be augmented with an arbitrary number of constraints.

A basic requirement is that any vehicle i can communicate with at least one other neighboring vehicle. Given that τ is the number of vehicles in the neighborhood of i that it can communicate with, then i,i=1n individually synthesizes a Laplacian-like stochastic matrix Li so that all xi are driven to consensus on the unit sphere. The synthesis of Li is as follows. A semidefinite matrix variable, ΛiS3 for each i is generated. Then

Lit=τΛ1itΛ2itΛτit,ẋit=τΛ1itΛ2itΛτitx1Tt x2TtxτTtT=Litx1Tt  x2TtxτTtT,E5

where xiTt,i=1,,τ are the position vectors of vehicles that i is communicating with at time t. For the purpose of analysis, the collective description for n vehicles is given as

Lt=Λ1t00ΛntΛtl11I3l1nI3ln1I3lnnI3Γ=LI3,E6

where, L=lij,ij=1n is the collective Laplacian matrix. Note that any Λi is unknown, we only want it to be positive semidefinite, therefore it is an optimization variable.

We can now define a collective semidefinite consensus protocol on a sphere as

ẋt=Ltxt.E7

The Euler’s first-order discrete time equivalents of Eqs. (5) and (7) are

xk+1i=xkitLitxki,E8
xk+1=xktẋk=xktLtxkE9

Each vehicle builds a SDP in which Eq. (8) is included as the dynamics constraint, augmented with several required convex constraints. For example, for the solution trajectories to remain on the unit sphere, norm constraints will be defined for each i as

xikTxk+1ixki=0.E10

Eq. (10) is the discrete time version of xitTẋit=0 or xtTẋt=0, which guarantees that xitTxit=1 or xtTxt=n for n vehicles, iff xi0=1i. Eq. (8) drives the positions xi0 to consensus while the norm constraint Eq. (10) keeps the trajectories on the unit sphere.

Theorem 1: As long as the associated (static) communication graph of L has a spanning tree, the strategy ẋt=Lxt achieves global consensus asymptotically for L [19].

Proof: The proof [19], is essentially that of convergence of the first-order consensus dynamics.

Next, we use the proof of Theorem 1 as a basis to develop the proof convergence of Eq. (7).

Theorem 2: The time varying system Eq. (7) achieves consensus if L is connected. Note that this proof had already been presented in [20].

Proof: Note that if x belongs to the consensus space C=xx1=x2==xn, then ẋ=0, (i.e. all vehicles have stopped moving). Because C is the nullspace of Lt, where Ltx=0 x. Meaning that once x enters C it stays there since there is no more motion. If consensus has not been achieved then xC, consider a Lyapunov candidate function V=xTΓx; V>0 unless xC. Then,

V̇=xTΓẋ+ẋTΓx,=xTΓLtxxTLtTΓx,=xTΓΛtΓxxTΓΛtΓx,=2xTΓΛtΓx,=2zTΛtz,E11

where z=Γx0 for xC. This implies that x approaches a point in C as t, which proves the claim. Eq. (11) is true for as long as L is nonempty, i.e., if some vehicles can sense, see or communicate with each other at all times.

4.2. Formulation of CAC based collision avoidance on the unit sphere

To incorporate collision avoidance, we apply the concept of constrained attitude control (CAC), as illustrated in Figure 1. We want the time evolution of the position vectors x1t, x2t and x3t to avoid two constraint regions around xobs1 and xobs2. The obstacle regions are defined by cones, whose base radii are r1 and r2, respectively. Let the angle between vehicles i and j be θij, and that between vehicle i and obstacle k be φik. Then the requirements for collision avoidance are: φ11α1, φ21α1, φ31α1, and φ12α2, φ22α2, φ32α2, tt0tf. They have the following equivalent quadratic constraints:

x1tTxobs1cosα1,E12
x2tTxobs1cosα1,E13
x3tTxobs1cosα1,E14
x1tTxobs2cosα2,E15
x2tTxobs2cosα2,E16
x3tTxobs2cosα2.E17

By using the Schur’s complement formula [21], the above constraints will be converted to the form of linear matrix inequalities (LMI) in order to include them into the respective SDPs. The Schur’s complement formula states that the inequality

SR1STQ0E18

where Q=QT, R=RT, and R>0, is equivalent to, and can be represented by the linear matrix inequality

QSSTR0.E19

Next, we attempt to make our quadratic constraints to look like the Schur’s inequality. Observe that Eq. (12) is equivalent to

x1tTxobs1Tx1tT0312I312I303x1txobs1x1tcosα1E20

Multiply Eq. (20) by 2 and we have

x1tT03I3I303Gx1t2cosα1.E21

We desire a positive definite G, i.e. G>0, or whose eigenvalues are all nonnegative (this is synonymous with R in the Schur inequality). To make G positive definite, one only needs to shift the eigenvalues by choosing a positive real number μ which is larger than the largest absolute value of the eigenvalues of G, then

x1tTμI6+03I3I303x1t2cosα1+μ.E22

Let M=μI6+03I3I3031, then M is positive definite. Thus, following the Schur’s complement formula, the LMI equivalent of Eq. (12) becomes

2cosα1+μx1txobs1Tx1txobs1M0,E23

The LMI equivalents of Eqs. (12) to (17) in discrete time can now be written as follows

2cosα1+μx1k+1xobs1Tx1k+1xobs1M0,E24
2cosα1+μx2k+1xobs1Tx2k+1xobs1M0,E25
2cosα1+μx3k+1xobs1Tx3k+1xobs1M0,E26
2cosα2+μx1k+1xobs2Tx1k+1xobs2M0,E27
2cosα2+μx2k+1xobs2Tx2k+1xobs2M0,E28
2cosα2+μx3k+1xobs2Tx3k+1xobs2M0.E29

Figure 2 shows the result for applying the above strategy to the rendezvous of 4 vehicles on a sphere, with avoidance of a static obstacle xobs, with α=30o.

Figure 2.

Four-vehicle rendezvous on a unit sphere with collision avoidance of a static obstacle. The figure shows the evolution of the x,y,z positions of the four vehicles x1,x1,x3,x4 from initial to final positions.

4.3. Formulation of formation control on the unit sphere

Formation patterns are obtained by specifying a minimum angular separation of βijt between any two vehicles i and j thereby defining relative spacing between individual vehicles. Using the avoidance strategy formerly described, the constraint θijβiji,j is used to define the set of avoidance constraints that will result in the desired formation pattern. The relative spacing results in intervehicle collision avoidance. For n vehicles, the avoidance requirements result in extra Pn2=n!n2! constraints, which are included along with the static obstacle avoidance constraints such as Eqs. (24) to (29). Figure 3 shows the result for applying the above strategy to the rendezvous with inter-vehicle avoidance and static obstacle avoidance, of four vehicles, using a fully connected graph Topology 1 in Figure 4. In this experiment α=30o and the minimum angular separations between the vehicles is set at a constant value βij=20oi,j. Therefore, in addition to the four static obstacle avoidance constraints (such as Eqs. (24) to (29), with α1=α), each vehicle has three more intervehicle collision avoidance constraints such as

2cosβij+μxik+1xjk+1Txik+1xjk+1M0,E30

Figure 3.

Four-vehicle formation acquisition on a unit sphere with collision avoidance of a static obstacle, and with inter-vehicle collision avoidance. The figure shows the evolution of the x,y,z positions of the four vehicles x1,x1,x3,x4 from initial to final positions.

Figure 4.

Topology 1 (left) is a fully connected communication graph with no leader, topology 2 (center) is a cyclic communication graph with one leader, node 1, and topology 3 (right) is a cyclic communication graph with no leader.

i,jij.

Putting it all together, the optimization problem of finding a feasible sequence of consensus trajectories with collision avoidance on a unit sphere may be posed as a semidefinite program (SDP) as follows. Given the set of initial positions xit0,i=1n and the plant Eq. (5) for each vehicle, find a feasible sequence of trajectories that satisfies the following constraints:

xk+1i=xkitLitxki,dynamics constraintxikTxk+1ixki=0,normconstraint2cosαij+μxik+1xobsjTxik+1xobsjM0,static obstacle avoidance constraint2cosβij+μxik+1xjk+1Txik+1xjk+1M0,intervehicle avoidance constraint

where xk+1i and Λki (which are components of Li) are the optimization variables. They are declared as SDP variables where Λki shapes the trajectories xk+1i to satisfy norm and avoidance constraints.

4.4. Consensus-based collision-free arbitrary reconfigurations on the unit sphere

Consider a more traditional reconfiguration problem that may not require formation control. For example, in a tracking problem, several vehicles are required to change their positions by tracking that of a set of virtual leaders, whose positions may be static or time-varying. For this to be possible, each vehicle must be connected to its corresponding virtual leader via a leader-follower digraph, see Figure 5 for an example topology for three vehicles. In Figure 5, the vertices in dashed circles are the states of the virtual leaders, while those with solid circles correspond to the states of the real vehicles. There are three unconnected separate leader follower digraphs (edges indicated with arrows). In addition, there is an undirected graph (edges without arrows) which enables the vehicles to communicate bidirectionally to provide data for inter-vehicle collision avoidance.

Figure 5.

Multiple virtual leaders graph topology with an undirected topology.

If xvit is the state of a virtual leader corresponding to vehicle i, then for each leader-follower vehicle pair xit=xvitT xitTT the corresponding leader-follower Laplacian matrix is

Ltt=0001.E31

The corresponding collective dynamics of xit is

ẋit=Λit00ΛitLttI3xit.E32

This configuration was applied in the reconfiguration experiment in Section 5.2. Practical application of this strategy to the problem of separation in air traffic control is presented in [18, 20].

Advertisement

5. Simulation results

Due to limitation of space, two simulation results are presented for consensus with collision avoidance on the unit sphere, more simulation results are in [18, 20]. The first experiment is to test formation acquisition with avoidance on the sphere. The second experiment is to test arbitrary reconfigurations on the sphere with collision avoidance. Three different communication topologies used are shown in Figure 4. In Figure 4, Topology 1 (left) is a fully connected communication graph with no leader, Topology 2 (center) is a cyclic communication graph with one leader, node 1, and Topology 3 (right) is a cyclic communication graph with no leader.

Optimization software Sedumi [22] and Yalmip [23] running inside Matlab R2009a, were used for solving all the problems. The simulations were done on an Intel R Core(TM)2 Duo P8600 @ 2.40GHz with 2 GB RAM, running Windows 7.

5.1. Formation acquisition on the unit sphere with avoidance

In this experiment, ten vehicles converge to a formation on the sphere, which is realized by maintaining a relative spacing with each other while also avoiding a static obstacle, with α=30o. Angle βij=20o is set to maintain the relative spacing between the vehicles i,j=110,ij. The initial positions are:

x10=0.34170.55550.7581Tx20=0.49600.12700.8589Tx30=0.30450.94970.0730Tx40=0.57350.79520.1967Tx50=0.80050.38670.4580Tx60=0.37270.73720.5637Tx70=0.03550.51170.8585Tx80=0.65530.74280.1371Tx90=0.91880.24460.3094Tx100=0.02610.87730.4792T

The result for Topology 1 is shown in Figure 6 (left), while the right figure shows the result obtained using Topology 3 – a cyclic graph which produces a circulant Laplacian L, whose dynamics leads to swirling motion. The proof is in [18].

Figure 6.

Ten-vehicle formation acquisition using topology 1 (left), and using topology 3 (right).

When relative spacing are specified between the vehicles, the motion obtained from this Laplacian is like the result obtained in [11]. However, when there is no relative spacing specified, the circular motion converges to a point. Using a circulant matrix such as that of Topology 3, one can vary the radius of the circular formation achieved r=cosθij; by setting θij equal for all i,j and varying its size with time. If the magnitude of angle θ is reduced, the radius of the circular formation structure obtained also reduces, and vice versa. Figure 7 (left) shows the result for setting θij=30oi,j for four vehicles. The center and right figures show the results for ten vehicles as θij moves gradually from 20o toward 0o. When θij=0i,j, the vehicles rendezvous to a point.

Figure 7.

Four-vehicle formation acquisition using topology 3 with βij=30o (left), and ten-vehicle formation acquisition, using topology 3, with βij=20o (center) and βij=0o (right).

5.2. Collision free reconfiguration on the unit sphere with avoidance of no-fly zones

This is a more traditional reconfiguration problem which we try to solve by using the consensus based protocols presented in this chapter. Three flying vehicles (e.g. UAVs), are required to fly from their initial positions to given final positions. There are cross-paths (inter-vehicle collision constraints) in addition to no-fly zones (static obstacle constraints), between the initial and final positions. The initial positions are:

x010=0.865900.4999Tx020=0.41650.57210.7071Tx030=0.58780.8090T

The desired final positions are:

xf10=0.43300.74990.4999Txf20=0.29390.90450.309Txf30=0.93930.30520.1564T

For inter-vehicle collision avoidance, they are required to maintain a minimum safety distance of r=cos10o units. Five no-fly zones are imposed on the vehicles at the following positions:

xobs1=0.52370.72080.454Txobs2=0.29390.90450.309Txobs3=00.98770.1564Txobs4=0.58780.8090Txobs5=00.95110.309T

The radii of the no-fly zones are equal to r, therefore βij=αij=10oi,jij for this simulation. The result is shown in Figure 8.

Figure 8.

Three-vehicle reconfiguration with collision avoidance and avoidance of no-fly zones.

On a final note, we have attempted to solve the problem of consensus in a spherical coordinate system by solving in on the unit sphere. The same unit sphere was used in [11]. This is convenient because the results are easier to visualize and compute on the unit sphere. The results presented here can be applied directly to real-life planetary navigation problems such as horizontal separation of aircraft [18, 20], simply by transforming actual position vectors into unit vectors in the unit sphere, solving to obtain the solution trajectories, and transforming the solutions back to actual desired trajectories in the real-world coordinates. The unit of measurement for implementation will therefore depend on the application at hand.

References

  1. 1. Beard RW, McLain TW, Nelson DB, Kingston D. Decentralized cooperative aerial surveillance using fixed-wing miniature UAVs. Proceedings of the IEEE. 2006;94(7):1306-1324. DOI: 10.1109/JPROC.2006.876930
  2. 2. Leonard NE, Paley DA, Lekien F, Sepulchre R, Fratantoni DM, Davis RE. Collective motion, sensor networks and ocean sampling. Proceedings of the IEEE. 2007;95(1):48-74. DOI: 10.1109/JPROC.2006.887295
  3. 3. Mesbahi M, Hadaegh H. Formation flying control of multiple spacecraft via graphs, matrix inequalities, and switching. Journal of Guidance, Control, and Dynamics. 2001;24(2):369-377. DOI: 10.2514/2.4721
  4. 4. Blackwood G, Lay O, Deininger B, Gudim M, Ahmed A, Duren R, Noeckerb C, Barden B. The StarLight mission: A formation-flying stellar interferometer. In: SPIE 4852, Interferometry in Space; 22 August; Waikoloa, Hawaii. SPIE Digital Library; 2002. DOI: 10.1117/12.460942
  5. 5. Justh EW, Krishnaprasad PS. Equilibria and steering laws for planar formations. Systems and Control Letters. 2004;52(1):25-38. DOI: 10.1016/j.sysconle.2003.10.004
  6. 6. Sepulchre R, Pale DA, Leonard NE. Stabilization of planar collective motion: All-to-all communication. IEEE Transactions on Automatic Control. 2007;52(5):811-824. DOI: 10.1109/TAC.2007.898077
  7. 7. Chandler PR, Pachter M, Rasmussen S. UAV cooperative control. In: IEEE ACC; 25–27 June; Arlington, VA. IEEEXplore; 2001. pp. 50-55. DOI: 10.1109/ACC.2001.945512
  8. 8. Richards A, Schouwenaars T, How JP, Feron E. Spacecraft trajectory planning with avoidance constraints using mixed-integer linear programming. AIAA Journal of Guidance Control and Dynamics. 2002;25:755-764. DOI: https://doi.org/10.2514/2.4943
  9. 9. Okoloko I, Basson A. Consensus with collision avoidance: An LMI approach. In: 5th IEEE International Conference on Automation, Robotics and Applications; 06–08 December; Wellington, NZ. IEEE; 2011. ISBN:9781457703287
  10. 10. Okoloko I. Path Planning for Multiple Spacecraft using Consensus with LMI Avoidance Constraints. In: IEEE Aerospace Conference; 3–10 March; Big Sky, Montana. IEEEXplore; 2012. pp. 1-8. DOI: 10.1109/AERO.2012.6187118
  11. 11. Paley D. Stabilization of collective motion on a sphere. Automatica. 2009;41:212-216. DOI: 10.1016/j.automatica.2008.06.012
  12. 12. Hernandez S, Paley DA. Stabilization of collective motion in a time-invariant flowfield on a rotating sphere. In: IEEE ACC; St. Louis, MO: IEEEXplore; 2009. pp. 623-628. DOI: 10.1109/ACC.2009.5160631
  13. 13. Justh EW, Krishnaprasad PS. Natural frames and interacting particles in three dimensions. In: Proceedings of Joint 44th IEEE CDC and European control conf.; 12–15 December; Seville, Spain. IEEEXplore; 2005. pp. 2841-2846. DOI: 10.1109/CDC.2005.1582594
  14. 14. Kim Y, Mesbahi M. Quadratically constrained attitude control via semidefinite programming. IEEE Transactions on Automatic Control. 2004;49:731-735. DOI: 10.1109/TAC.2004.825959
  15. 15. Biggs N. Algebraic Graph Theory, Cambridge Tracks in Mathematics. 2nd ed. Cambridge University Press; 1974. p. 205. ISBN: 0521458978
  16. 16. Peng L, Zhao Y, Tian B, Zhang J, Bing-Hong W, Hai-Tao Z, Zhou T. Consensus of self-driven agents with avoidance of collisions. Physical Review. 2009;79(E). DOI: 10.1103/PhysRevE.79.026113
  17. 17. Olfati-Saber R. Flocking for multi-agent dynamic systems: Algorithms and theory. IEEE Transactions on Automatic Control. 2006;51(3):401-420. DOI: 10.1109/TAC.2005.864190
  18. 18. Okoloko I. Multi-path planning and multi-body constrained attitude control [dissertation] PhD Thesis. Stellenbosch, South Africa: Stellenbosch University; 2012. p. 185. Available from: http://hdl.handle.net/10019.1/71905
  19. 19. Ren W, Beard RW, McLain TW. Coordination variables and consensus building in multiple vehicle systems. In: Kumar V, Leonard NE, Morse AS, editors. Lecture Notes in Control and Information Sciences. 309th ed. Berlin: Springer-Verlag; 2005. pp. 171-188 ISSN: 2572-4479
  20. 20. Okoloko I. Consensus Based Distributed Motion Planning on a Sphere. In: IEEE ACC; 17–19 June; Washington DC. IEEEXplore; 2013. pp. 6132-6137. DOI: 10.1109/ACC.2013.6580799
  21. 21. Boyd S, Ghaoui LE, Feron E, Balakrishnan V. Linear Matrix Inequalities in System and Control Theory. Philadelphia, PA: SIAM; 1994. p. 205. ISBN: 0-89871-334-X
  22. 22. Sturm JF. Using SeDuMi 1.02, a Matlab toolbox for optimization over symmetric cones. Optimization Methods and Software. 1998;11(12):625-653. DOI: 10.1080/10556789908805766
  23. 23. Yalmip LJ. A toolbox for modelling and optimization in Matlab. In: IEEE CACSD Conference; 2–4 Sept.; Taipei, Taiwan. IEEEXplore; 2004. pp. 284-289. DOI: 10.1109/CACSD.2004.1393890

Written By

Innocent Okoloko

Submitted: 16 May 2017 Reviewed: 22 September 2017 Published: 26 September 2018