Next Article in Journal
Concrete Object Anomaly Detection Using a Nondestructive Automatic Oscillating Impact-Echo Device
Next Article in Special Issue
Robust Visual-Aided Autonomous Takeoff, Tracking, and Landing of a Small UAV on a Moving Landing Platform for Life-Long Operation
Previous Article in Journal
Passive Thermal Management of Tablet PCs Using Phase Change Materials: Intermittent Operation
Previous Article in Special Issue
An Auto-Adaptive Multi-Objective Strategy for Multi-Robot Exploration of Constrained-Communication Environments
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Unscented Transformation-Based Multi-Robot Collaborative Self-Localization and Distributed Target Tracking

1
School of Automation, Northwestern Polytechnical University, Xi’an 710072, China
2
Key Laboratory of Advance Manufacturing Technology, Ministry of Education, Guizhou University, Guiyang 550025, China
*
Authors to whom correspondence should be addressed.
Appl. Sci. 2019, 9(5), 903; https://doi.org/10.3390/app9050903
Submission received: 26 December 2018 / Revised: 11 February 2019 / Accepted: 27 February 2019 / Published: 3 March 2019
(This article belongs to the Special Issue Multi-Robot Systems: Challenges, Trends and Applications)

Abstract

:
The problem of multi-robot collaborative self-localization and distributed target tracking in practical scenarios is studied in this work. The major challenge in solving the problem in a distributed fashion is properly dealing with inter-robot and robot–target correlations in order to realize consistent state estimates of the local robots and the target simultaneously. In this paper, an unscented transformation-based collaborative self-localization and target tracking algorithm is proposed. Inter-robot correlations are approximated in a distributed fashion, and robot–target correlations are safely discarded with a conservative covariance intersection method. Furthermore, the state update is realized in an asynchronous manner with different kinds of measurements while accounting for measurement and communication limitations. Finally, to deal with nonlinearity in the processes and measurement models, the unscented transformation approach is adopted. Unscented transformation is better able to characterize nonlinearity than the extended Kalman filter-based method and does not require computation of the Jacobian matrix. Simulations are extensively studied to show that the proposed method can realize stable state estimates of both local robots and targets, and results show that it outperforms the EKF-based method. Moreover, the effectiveness of the proposed method is verified on experimental quadrotor platforms carrying off-the-shelf onboard sensors.

1. Introduction

Multi-robot systems (MRSs) have garnered tremendous research interest in recent years [1]. Compared with a single robot, an MRS usually has greater efficiency and operational capability in accomplishing complex tasks, such as transportation [2], search and rescue [3], and mapping [4]. Among these MRS applications are the fundamental tasks of obtaining reliable localization information for the local robot and the uncooperative target using various measurements; these two processes are often referred to as collaborative self-localization (CL) [5,6,7,8,9] and distributed target tracking (DT) [10,11,12,13], respectively. In the CL process, each robot measures the relative quantities with regard to neighboring cooperative robots. By cooperating with other robots, each robot is able to refine its own positioning information. In the DT process, each robot performs a measurement function on the uncooperative targets to be tracked. Then, the states of the target can be estimated cooperatively through interactions with other robots. Although the problems of CL and DT are usually solved by two separate techniques, such as in [5,6,7,8,9,10,11,13,14,15,16,17], they are correlated in most practical scenarios. In the DT process, the target tracking accuracy is dependent on the localization information of the corresponding robots, as well as the relative measurements between the robot and target. The target tracking results obtained by each local robot, in turn, can be implemented to improve the localization performance of the robots. To realize MRS self-localization and target tracking simultaneously, a combined collaborative self-localization and distributed target tracking (CLAT) framework is studied in this paper.
The problem of multi-robot collaborative localization has drawn significant attention in recent years. In [18], the state of the art in collaborative localization is surveyed, and the theoretical limits, algorithms, and practical challenges are discussed. As one of the fundamental challenges in CL, the application of a proper data fusion strategy to deal with the correlations between robots was studied in [5,6,7,8,9,14,15]. A direct approach involves the local robot treating the states of neighboring robots as fully confident variables that will lead to zero correlations between robots [5]. However, this impractical assumption of neighboring positions can lead to overconfident estimates. A more practical method to fuse the relative measurements when the correlation is unknown is the implementation of conservative correlation approximation methods, such as covariance intersection (CI) [6] or split covariance intersection (SCI) [7]. A CL approach using CI was proposed in [14]. This method is provably consistent and can handle asynchronous communication and measurement. The SCI-based approach, as studied in [7,8], further separates the covariance into correlated and uncorrelated parts, and the latter is fused using the CI method. Despite the ability of CI-based methods to preserve the consistency of the estimates, they often have overly conservative results. Making a trade-off between estimation accuracy and the corresponding cost during the CI-based collaborative localization process was investigated using the optimal scheduling problem in [19]. Another popular method to deal with the CL problem is based on factor graphs, which are formulated on the basis of entire trajectories, such as in [15]. The correlation can be explicitly tracked in the factor-graph-based method. However, storing all of the measurements resulting from this method requires significantly more storage space than the recursive method. To address the above drawbacks, a recursive extended Kalman filter (EKF)-based CL method was proposed in [20], in which the correlation was accurately tracked in a decentralized manner. In [21], the processing and storage costs were further reduced by introducing a server that broadcasts an update message when an inter-robot relative measurement is taken. However, in this method, when a relative measurement is taken between two robots, communication involves all robots rather than just the two in the relative measurement, and this significantly increases the communication burden. Another recursive EKF-based CL method was proposed in [9]. This method efficiently approximates the correlation and only stores the current measurement. When the relative measurement is taken, only the communication between the two robots is required.
The distributed tracking problem has also been extensively studied [22]. Early-stage algorithms that have been proposed to solve this problem can be roughly split into two categories: consensus-based algorithms [16] and diffusion-based algorithms [10]. The former category, in general, requires multiple communication iterations during each sampling time interval and hence could lead to a heavy communication burden. To reduce the communication bandwidth, a distributed Kalman filter with event-triggered communication was proposed in [23], and the stability is guaranteed. The latter category does not have such drawbacks, but it may require local joint detectabilities at every single agent, and such a requirement might not be satisfied in a general multi-robot target tracking scenario. A more practical DT approach called distributed hybrid information fusion (DHIF) [11] is able to guarantee stability and is asymptotically unbiased with very mild sufficient conditions. To further solve the distributed tracking problem with a nonlinear process and sensing models, an EKF-based paradigm was proposed in [24], and the stability was analyzed in [25]. Also, the unscented transformation-based approach, which has been regarded as a superior alternative to the EKF when the systems are highly nonlinear, was integrated with the DT process in [26]. However, both the EKF and unscented Kalman filter (UKF) mentioned above are consensus-based and hence may generally result in a heavy communication burden. Recently, the aforementioned DHIF was extended to a nonlinear scenario using the DT approach in [12], and the stochastic stability was analytically studied. Besides the methodology research and theoretical analyses above, the performance of different fusion strategies in terms of their communication rate, information type, and memory size were compared in [27].
The CLAT framework has gained attention in recent years. There are two main kinds of methods: batch and recursive methods. The batch method estimates the entire state trajectory on the basis of all measurements and motion information up to the present, and the recursive method uses only the current measurement and control information. The batch-based method is supposed to outperform the recursive method but at the cost of significantly larger computation and storage requirements and, if in a distributed fashion, communication requirements. One batch-based method was proposed in [28]. By introducing a factor graph that contained robot and target nodes and relative measurements, the problem was formulated as a least-square minimization problem and was solved with sparse optimization methods. Another batch-based method was presented in [29], where the CLAT problem was formulated as a maximum a posteriori estimation problem, and the unscented transformation (UT) technique was implemented to better characterize the nonlinear process. Furthermore, the observability condition was extensively studied. For an MRS with limited computation and storage capacity, the recursive method is often preferred. A recursive-filter-based CLAT was studied in [30], and the error bounds are theoretically provided. Nevertheless, the results in [30] are based on a specially designed measurement graph so that the correlation can be tracked properly. A recursive Bayesian method was proposed in [31] to perform the CLAT in a distributed sequential fashion; however, this method needs synchronous communication at each time instance and will therefore add a significant communication burden. Further, an error propagation analysis was carried out, and the convergence conditions are given in [32], which showed that the localization and tracking accuracy only depends on the expectation of the measurement precision.
In this paper, the multi-robot localization and target tracking problem with a general nonlinear process and various measurement models is studied, and a UT-based CLAT scheme is proposed with consideration of the communication and memory limitations. The main contributions of this paper are summarized as follows: First, the proposed UT-based CLAT is recursive, and it does not store measurements; each robot only keeps the latest estimates of its own and the target, so the storage requirement is significantly reduced. Furthermore, communication is limited to the two robots to obtain a cooperative relative measurement, and no communication with other robots is needed. Meanwhile, to guarantee estimation consistency, inter-robot correlations are approximated in a distributed fashion on the basis of the covariance split method, and the robot–target correlation is discarded using the conservative CI method. Finally, the overall system is modeled on the basis of general nonlinear models and is characterized on the basis of the UT approach rather than the EKF method. Thus, the computation of a Jacobian is avoided. Simulations were carried out, and they indicate that the proposed UT-CLAT method is able to realize stable state estimates of both local robots and targets. More importantly, a hardware platform containing three quadrotors was implemented to verify the effectiveness of the proposed UT-CLAT method. Specifically, three types of measurements (absolute measurement, relative cooperative, and uncooperative measurement) from, respectively, the navigation system, ultra-wide bandwidth (UWB) transmitters, and onboard cameras were utilized to effectively estimate the states of the local robots and targets.
The rest of this paper is organized as follows: Section 2 formulates the CLAT problem, and Section 3 describes the proposed CLAT method. Section 4 and Section 5, respectively, provide the simulation results, which are based on synthetic data, and experimental results, which are based on hardware platforms. Section 6 concludes the paper.

2. Problem Formulation

2.1. Models

Consider N homogeneous cooperative robots, denoted as i V , performing collaborative self-localization and distributed tracking of a target of interest, denoted as t. The dynamics of the cooperative robots and the target are expressed respectively with the following nonlinear process models:
x i , k + 1 = f v ( x i , k , u i , k ) ,
x t , k + 1 = f t ( x t , k , w t , k ) ,
where x i , k R n v and x t , k R n t respectively denote the state of robot i and target t at time k. u i , k R n u is the control input of robot i, which is assumed to be subject to a Gaussian distribution u i , k N u ¯ i , k , Q i . u ¯ i denotes the control command, and Q i is the control input covariance. w t , k R n w is the process noise of the target and is assumed to be drawn from a zero-mean Gaussian distribution w t , k N 0 , Q t . It is assumed that all robots i V share the same nonlinear transformation f v : R n v × R n u , and the moving target nonlinear transformation f t : R n t × R n w is known to all robots.
In the cooperative localization and target tracking scenario, each robot i is able to measure three pieces of information: its absolute state and the relative pairwise measurements to neighboring robots and to the target. The measurements at time instance k are denoted respectively as z i , k a R n z a , z i j , k c R n z c , j V \ { i } , and z i t , k t R n z t . The corresponding measurement functions are listed below:
z i , k a = h a ( x i , k , v i , k a ) ,
z i j , k c = h c ( x i , k , x j , k , v i , k c ) ,
z i t , k t = h t ( x i , k , x t , k , v i , k t ) ,
where v i , k a , v i , k c and v i , k t are the measurement noise of the above three measurement processes and assumed to be drawn from zero-mean Gaussian distributions, i.e., v i , k a N ( 0 , R i a ) , v i , k c N ( 0 , R i c ) , and v i , k t N ( 0 , R i t ) .
Defining the CLAT as a graph G ( V , E ) , the node set V = V { t } { 0 } , and the special node 0 denotes the absolute position origin. The edge set is denoted as E V × V . For a robot i V , an edge ( i , 0 ) denotes a robot that can access its own absolute position. In this paper, it is assumed that a subset of the robots V can obtain the absolute measurement z k a . An edge ( i , t ) indicates that a robot i is able to detect a target t. Since the sensing range of an uncooperative sensor is limited, the availability of an uncooperative target measurement depends on the relative positions of the robot and the target. An edge ( i , j ) , j V \ i denotes that a pairwise measurement between robots i and j is obtained. Similarly, a cooperative relative measurement is available when two robots are within the cooperative sensing range. Moreover, in this paper, it is assumed that whenever a relative measurement z i j , k c is taken, a communication link is established simultaneously between robots i and j so that they can share information.

2.2. Motivation and Objective

Although the CL and DT problems have been extensively studied, their combination still draws limited attention, especially when considering practical multi-robot operation conditions such as nonlinear models or limited sensing and communication capabilities. One answer to the above challenge was provided in [9] by implementing the EKF scheme and asynchronized measurement update. However, this only covered the CL task, and the uncooperative target was not considered. On the other hand, it is also well known that the computation of Jacobian matrices is required by EKF-based algorithms. This may cause difficulties during implementation. Moreover, the estimation performance may deteriorate if the assumption of local linearity is not valid (e.g., bearing sensors). An alternative approach to extending the algorithm while avoiding the aforementioned potential drawbacks is to use the UT.
Motivated by the above observations, in this paper, a UT-based CLAT scheme (UT-CLAT) is proposed that can realize self-localization and target tracking simultaneously in practical multi-robot operation scenarios. The correlations are properly addressed by implementing split covariance methods, similar to the method in [9], and the covariance intersection method. The UT approach was adopted to approximate the statistics of random variables in nonlinear models. In the end, the effectiveness of the proposed UT-CLAT algorithm is illustrated using not only simulations with synthetic data but also experiments with a networked quadrotor system and off-the-shelf sensors (cameras and UWB transmitters).

3. UT-Based CLAT

In this section, the proposed UT-CLAT is described. The states of local robots and targets are estimated using a recursive UT-based Kalman filter, with the aforementioned three types of measurements updated in an asynchronous fashion. For each robot i, the local states, covariance, and the correlation between it and other robots j V are tracked. Specifically, the correlation term is approximately tracked in a distributed fashion, similar to [9]. As a matter of fact, the target may be detected by different robots at different times. It is difficult to track the robot–target correlation in a local robot when there are inter-robot correlations. To realize consistent state estimation under unknown robot–target correlations, a conservative CI method is introduced to safely remove the robot–target correlation terms and the correlation between target estimates from different robots. The above algorithm consists of state propagation (Section 3.1) and three types of measurement update processes (Section 3.2). In particular, the communication link is supposed to be established only during the cooperative relative measurement update process and the data from different robots are fused.
Suppose that at time k, each robot i has a posterior estimated state and its error covariance at a previous time instance, denoted as x ^ i , k 1 and P i , k 1 , respectively. If a relative measurement between robots i and j is taken before time instance k, then the correlated term P i j , k 1 is arbitrarily decomposed as
P i j , k 1 = σ i j , k 1 σ j i , k 1
and respectively stored in robots i and j. Robot i also holds an estimation of the target t locally, denoted as x ^ t i , k 1 and P t i , k 1 .

3.1. Propagation

The propagation process involves the local robots as well as the target. According to the dynamics of Equations (1) and (2), each robot propagates its own state estimates and the local estimate of the target.
Let the augmented state vector and the corresponding augmented covariance matrix for each robot’s local state at time k 1 be denoted respectively as x ^ i , k 1 a R n a and P i , k 1 a R n a × n a , where n a = n v + n u ,
x ^ i , k 1 a x ^ i , k 1 u ¯ i , k 1 , and P i , k 1 a P i , k 1 0 0 Q i .
A set of 2 n a + 1 sigma points, denoted as X a , is selected as follows:
X i , k 1 a , 0 = x ^ i , k 1 a , X i , k 1 a , r = x ^ i , k 1 a + n a + γ P i , k 1 a : , r , if r { 1 , , n a } , X i , k 1 a , r = x ^ i , k 1 a n a + γ P i , k 1 a : , r n a , otherwise .
Here, γ = α 2 n a + κ n a is a scaling parameter, with 0 < α 1 and κ R as tuning parameters to control the spread of the sigma points. The weights for propagating the mean and covariances, denoted respectively as W m r and W c r , are computed as
W m 0 = γ / n a + γ , W c 0 = γ / n a + γ + 1 α 2 + β , W m r = W c r = 1 / 2 n a + γ , r = 1 , , 2 n a ,
where β is used to incorporate extra higher-order effects. Note that the definition of the sigma points directly implies that
r = 0 2 n a ( W m r ) X i , k 1 a , r = X i , k 1 a , 0 = x ^ i , k 1 a ,
or equivalently,
r = 0 2 n a W m r X i , k 1 r = x ^ i , k 1 , r = 0 2 n a W m r U k 1 r = u ¯ i , k 1 ,
where X i , k 1 r and U i , k 1 r collect the components of X i , k 1 a , r corresponding to, respectively, x i , k 1 and u i , k 1 .
The above unscented transform is summarized below:
X i , k 1 a , r = U T ( x ^ i , k 1 a , P i , k 1 a ) , r = 0 , , 2 n a .
By defining the augmented state vector and the covariance with regard to the local estimates of the target t within robot i similar to Equation (7), the UT of the target t can be summarized as
X t i , k 1 a , r = U T ( x ^ t i , k 1 a , P t i , k 1 a ) , r = 0 , , 2 n a .
Then, the prior local estimates and corresponding error covariance of the current state and target are computed respectively as
x ^ i , k = r = 0 2 n a W m r X i , k r ,
P i , k = r = 0 2 n a W c r X i , k r x ^ i , k X i , k r x ^ i , k ,
and
x ^ t i , k = r = 0 2 n a W m r X t i , k r ,
P t i , k = r = 0 2 n a W c r X t i , k r x ^ t i , k X t i , k r x ^ t i , k ,
where
X i , k r = f v X i , k 1 r , U i , k 1 r , r = 0 , , 2 n a ,
and
X t i , k r = f t X t i , k 1 r , W t i , k 1 r , r = 0 , , 2 n a .
X t i , k 1 r and W t i , k 1 r are the sigma points corresponding to x t i , k 1 and w t , k 1 , and
r = 0 2 n a W m r X t i , k 1 r = x ^ t i , k 1 , r = 0 2 n a W m r W k 1 r = 0 .
The propagation of the correlation term P i j involves the pose and control inputs of both i and j, and therefore cannot be propagated locally by robot i. To avoid communication, the local correlation term σ i j is instead propagated as
σ i j , k = F v σ i j , k 1 ,
where F v is the inferred Jacobian matrix with regard to the dynamic function in Equation (1) and, according to [33], is defined as
F v = P i , k | k 1 x x P i , k 1 1 ,
where P i , k | k 1 x x r = 0 2 n a ( X i , k r x ^ i , k ) ( X i , k 1 r x ^ i , k 1 ) .

3.2. Update

In the update stage, three types of measurement (Equations (3)–(5)) are considered. When a private measurement or a target measurement is taken by robot i, the information is updated locally to avoid communication. When two robots i and j are within the relative range, a relative measurement is taken, and local beliefs of both robot and target and the inter-robot correlation term are exchanged to update the estimates of the local robots and target. For clarity, x ^ , P and x ^ , P are used respectively to denote the state estimate and covariance prior to and after a certain measurement update process.

3.2.1. Private Update

During each private update process, the local robot measures its local pose through, for example, a GPS receiver and magnetometer, to refine its local estimation. Only the local pose participates in the private update process.
First, the inferred Jacobian H i , k corresponding to the measurement function in Equation (3) is obtained as
H i , k = P i , k x z r P i , k 1 ,
where
P i , k x z r = r = 0 2 n a W c r X i , k r x ^ i , k h a ( X i , k r ) z i , k a .
Then, the state and covariance can be updated as
x ^ i , k = x ^ i , k + K i , k z i , k a h i a ( x ^ i , k ) ,
P i , k = ( I K i , k H i , k ) P i , k ,
where
S i , k = ( H i , k ) P i , k H i , k + R i a , K i , k = P i , k H i , k S i , k 1 .
The correlation term within local robot i is updated as
σ i j , k = ( I K i , k H i , k ) σ i j , k , j V \ i .

3.2.2. Target Measurement Update

When a target is detected by robot i, a relative measurement related to the pose of both robot i and target t, denoted as z i t t , is obtained. The measurement update involves the estimates of the robot and the target, as well as their correlation term. As a matter of fact, the correlation term, denoted as P i t i , is difficult to track in a distributed fashion owing to the existence of the inter-robot correlation term. Therefore, in this part, a conservative CI-based method [34] is used to remove the robot–target correlations and guarantee consistency at the same time.
1 w 1 P i , k 0 0 1 1 w 1 P t i , k P i , k P i t i , k p t i i , k P t i , k .
The weight w is determined according to [34]. Let P ¯ i , k 1 w P i , k and P ¯ t i , k 1 1 w P t i , k . The augmented state can be defined as
x ^ i , k b = x i , k x t i , k 0 and P i , k b = P ¯ i , k 0 0 0 P ¯ t , k 0 0 0 R i t .
Then, the augmented sigma points are obtained as
X i , k b = U T x ^ i , k b , P i , k b , r = 0 , , 2 n a .
The inferred measurement Jacobian is
H i , k H t i , k H v , k = P i , k x z b ( P i , k b ) 1 ,
where
P i , k x z b = r = 0 2 n a W c r X i , k b x i , k b h t ( X i , k b ) z i t , k t .
The target measurement update process is finally summarized as Equations (19)–(22):
x ^ i , k = x ^ i , k + K i , k z i t , k t h i t ( x i , k b ) ,
x ^ t i , k = x ^ t , k + K t i , k z i t , k t h i t ( x i , k b ) ,
P i , k = ( I K i , k H i , k ) P ¯ i , k ,
P t i , k = ( I K t i , k H i , k ) P ¯ t i , k ,
where the innovation covariance and gain are calculated as
S i , k = H i , k H i t , k P ¯ i , k 0 0 P ¯ t , k H i , k H i t , k + R i u , K i , k = P ¯ i , k H i , k S i , k 1 , K t i , k = P ¯ t , k H t i , k S i , k 1 .
Formally, the correlation between robots i and j should be updated as
P i j , k = ( I K i , k H i , k ) P i j , k .
On the basis of the decomposition in Equation (6), the correlation term σ i j can be calculated as below without communication:
σ i j , k = ( I K i , k H i ) σ i j , k , j V \ i .

3.3. Neighbor Measurement Update and Target Information Fusion

When two robots i and j are within a given range, a relative measurement is taken, denoted as z i j , k , and a communication link between the two robots is established. The target update process is as follows. First, the covariance between two robots P i j is recovered according to Equation (6). Similar to the target measurement update process, we define the augmented state prior to the measurement update as
x ^ k c = x ^ i , k x ^ j , k 0 and P k c = P i P i j 0 P i j P j 0 0 0 R i c .
Then, the augmented sigma points are obtained as
X k c = U T x ^ k c , P i , k c , r = 0 , , 2 n a .
The inferred measurement Jacobian is
H i , k H j , k H v , k = P x z c ( P i , k c ) 1
where
P i , k x z c = r = 0 2 n a W c r X i , k c x ^ , k c h c ( X i , k c ) z i j , k c .
Consequently, the update process for the relative measurement between robots i and j is as below:
x ^ i , k = x ^ i , k + K i , k z i j , k h i c ( x ^ i , k c ) ,
x ^ j , k = x ^ t , k + K t , k z i t , k h i c ( x ^ i , k c ) ,
P i , k = ( I K i , k H i , k ) P i , k K i , k H j , k P j i ,
P j , k = ( I K j , k H j , k ) P j , k K j , k H i , k P i j ,
P i j , k = ( I K i , k H i , k ) P i j , k K i , k H j , k P j ,
where
S i , k = H i , k H j , k P i , k P i j , k , P i j , k P j , k H i , k H j , k + R c , K i , k = ( P i , k H i , k + P i j , k H j , k ) S k 1 , K j , k = ( P j i , k H i , k + P j , k H j , k ) S k 1 .
After the relative measurement update, the correlation P i j , k is decomposed again as two multiplicative parts σ i j , k and σ j i , k according to Equation (22). Then, σ i j , k and σ j i , k are stored in i and j, respectively.
The relative measurement update process also involves the correlation term P i l , k , l V , l i , j . Formally, the P i l , k should be updated as
P i l , k = ( I K i , k H i , k ) P i l , k K i , k H j , k P j l , k .
The correlation term P j l , k is not available to robot i. To reduce the overall communication and avoid communication with l, the split term σ i l in robot i is instead updated in an approximate form, similar to the process in [9], as below:
σ i l , k = P i , k ( P i , k ) 1 σ i l , k .
In addition to the measurement update, the target beliefs { x ^ t i , k , P t i , k } and { x ^ t j , k , P t j , k } are fused simultaneously. As a matter of fact, the correlation between the two estimates is unknown owing to the unknown target–robot correlation. Again, the conservative CI algorithm can be used as below:
P t , k = w 2 ( P t i , k ) 1 + ( 1 w 2 ) ( P t j , k ) 1 1 ,
x ^ t , k = P t , k w 2 P t i , k 1 x ^ t i , k + ( 1 w 2 ) P t j , k 1 x ^ t j , k .
The weight w 2 can be determined according to [11]. The fused results are then stored in both robots i and j.

4. Simulation

In this section, the proposed UT-CLAT method is validated using synthetic data. Without loss of generality, the scenario contains four cooperative robots, labeled 1–4, tracking an uncooperative target in 2D space (as shown in Figure 1). The robots and the target are assumed to be subject to similar nonlinear unicycle models, as below:
x k + 1 x k + 1 y k + 1 θ k + 1 = x k + Δ T ( v c + w k v ) cos ( θ k ) y k + Δ T ( v c + w k v ) sin ( θ k ) θ k + Δ T ( ω c + w k ω ) ,
A subscriber i or t is used to distinguish the robots or the target. The state vector x k to be estimated contains three entries— x k , y k , and θ k —which represent the 2D position and the orientation of the robots and the target with respect to the global frame. It is assumed that at the initial time, the robots are randomly placed on different circles centered at 10 , 10 , 10 , 10 , 10 , 10 , 10 , 10 . The same control command u = v c , ω c = 0.3 , 0.0375 is applied to each robot to form four approximated circles with radii 8. The velocity and angular velocity noise are assumed to be subject to Gaussian distributions with the covariance Q i = diag ( [ 0.1 2 , ( 0.5 π / 180 ) 2 ] ) . The target is initialized at 15 , 15 in the global frame, and the control input is set as u t = [ 0.05 , 0 ] . Similarly, the target control is subject to zero-mean Gaussian noise with Q t = diag ( [ 0.02 2 , ( 2 π / 180 ) 2 ] ) .
In the simulation, robot 1 is assumed to be accessible to the global position and orientation in the global frame with the following measurement model:
z i , k a = x i , k + v i , k a ,
where v i , k a N ( 0 , diag ( 0.5 2 , 0.5 2 , 0.5 π / 180 ) 2 ) is the control noise.
Both the cooperative robots and uncooperative measurement are subject to a relative range measurement model as follows:
z i j , k c = x j x i d + v i , k c ,
z i t , k t = x t x i d + v i , k t ,
· d is the operator that calculates the relative range between two robots or a robot and the target. The sensing range for the target is set as r t = 20 , and the sensing range for cooperative robots, as well as the communication range, is set as r c = 10 . The measurement noises are v i c N ( 0 , 0.05 2 ) and v i t N ( 0 , 0.05 2 ) , respectively.

4.1. Scenario 1

One trial of the simulation described above was carried out. In this scenario, the target is jointly observed by the four robots intermittently. The observation measurement availability for both cooperative measurement and target measurement is based on the sensing ranges r c and r t , respectively, and is shown in Figure 2 and Figure 3.
Although, for each robot, the observability of the local state and the target’s state cannot be guaranteed owing to the discontinuous range-only measurement, the joint observability for the entire system over a period of time can still be guaranteed through communication with neighbors according to [35].
The estimated trajectories of both robots and the target are plotted in Figure 4 in different colors. Each robot’s self-localization result and local target tracking result are drawn with solid lines of the same color. As observed in Figure 4, the estimated trajectories indicate that each robot is able to localize its true pose and track the true trajectory of the target. The four robots’ self-localization errors and covariances ( ± 3 σ bounds) are plotted in Figure 5, with solid lines in color and dashed lines in the same color, respectively. It shows that the self-localization errors by each robot are bounded by the ± 3 σ envelopes in the steady state. Robot 1 has the lowest tracking error as it can access its own absolute measurement. The target tracking results from the four robots are plotted in Figure 6, where, for each robot, the target tracking errors (solid line in colors) are bounded by the corresponding ± 3 σ envelopes (dashed line in the same colors) in the steady state. On the basis of Figure 5 and Figure 6, the min/max self-localization and target tracking errors for time instance k [ 200 , 800 ] are listed in Table 1.

4.2. Scenario 2

In this part, the performance results of the proposed UT-CLAT method are presented on the basis of 1000 Monte Carlo simulations. Specifically, the simulation in Scenario 1 was repeated 1000 times with 1 k 1200 . For each robot, the position root-mean-square errors (PRMSEs) of the local posterior estimates and target posterior estimates were computed for all trails. Moreover, to demonstrate the effectiveness in a nonlinear scenario, the proposed UT-CLAT method is compared to the EKF-CLAT method by extending the CL algorithm in [9] to the CLAT scenario. In Figure 7, the averaged PRMSEs of the collaborative localization results of 1000 Monte Carlo simulations are plotted using both the UT-CLAT and EKF-CLAT methods.
As observed in Figure 7, both methods can realize stable self-localization in around 200 time instances. In general, the UT-CLAT method is able to achieve more accurate self-localization results. In Figure 8, the averaged PRMSEs of the target tracking results of different robots are plotted. Similar to the CL result in Figure 7, the UT-CLAT is able to realize stable target tracking, and it outperforms the EKF-CLAT method for each robot.

5. Experimental Validation of Quadrotors

In this section, the validation results of the proposed UT-CLAT method are presented. Validation was performed using hardware platforms that included three quadrotors tracking a ground robot. As shown in Figure 9, the system consists of three Intel Aero RTF quadrotors, referred to as quad 1 –3, and one TurtleBot ground robot. Each quadrotor is equipped with UWB transmitters and a downward monochrome camera. The UWB sensors measure the relative distance and transmit information when two quadrotors are within the functional range of the UWB sensors. A camera is rigidly connected to the body frame of each quadrotor. A target is detected by the camera when the target is within the field-of-view (FOV). Furthermore, quad 1 is assumed to have access to its position through the onboard navigation system. In addition to the above onboard devices, UWB ground anchors are used to record the ground truth states of both robots and the target.

5.1. Robot and Target Dynamics Model

For target monitoring, each quadrotor is controlled to follow a plenary circular trajectory in 3D space. The state x i includes the position in 3D space and the heading angle, namely, x t = [ x i , y i , z i , θ i ] . u i [ v i , ω i ] denotes the control input command, namely, the linear plenary velocity and angular velocity. The actual velocity and angular velocity are contaminated by zero-mean Gaussian noises, w i , k v N 0 , Q i v , w i , k ω N 0 , Q i ω . An extra altitude noise w i , k z N 0 , Q i z is added to the process noise. The overall process noise covariance is denoted as Q i = blkdiag ( Q i v , Q i ω , Q i z ) . On the basis of the above definition, the process model for each robot f i is defined as follows:
x i , k + 1 x i , k + 1 y i , k + 1 z i , k + 1 θ i , k + 1 = x i , k + Δ T ( v i + w i , k v ) cos ( θ i , k ) y i , k + Δ T ( v i + w i , k v ) sin ( θ i , k ) z c + w i , k z θ i , k + Δ T ( ω i + w i , k ω )
The target ground robot is modeled with a unicycle model f t similar to Equation (33). Correspondingly, the state, control input, and process noise are denoted as x t , u t , and Q t = blkdiag ( Q t v , Q t ω , Q t z ) , respectively.

5.2. Measurement Model

The three types of measurement are utilized to realize the CLAT purpose in this system setup: private absolute measurement from the onboard navigation system, cooperative relative range measurement from the UWB sensors, and angle measurement relative to the target from the downward cameras.
Although the position information from the onboard navigation system is a fusion result from multiple sensors, in this part, it is treated as a private absolute measurement and is modeled as below:
z i , k a = H i a x i , k + v i , k a
The measurement noise is assumed to be subject to a zero-mean Gaussian distribution, v i , k a N ( 0 , R a ) . Obviously, the absolute measurement model is a linear model. Therefore, we can substitute the inferred Jacobian matrix (defined in Section 3.2.1) with H i a . In this paper, we assume that only a subset of all robots has access to the onboard navigation signal.
The cooperative relative measurement between robots i and j from UWB is a scalar distance modeled as the following nonlinear model:
z i j , k c = x i , k x j , k d + v i , k c ,
The measurement noise v i j , k c is assumed to be subject to the zero-mean Gaussian noise v i j , k c N ( 0 , R i c ) .
The target detection measurement is the position of the target on the captured image plane, and the measurement function is defined as
z i t , k t = d f x ¯ i t , k ( 1 : 2 ) x ¯ i t , k ( 3 ) + v i , k t
where d f denotes the focal length in pixels, x ¯ i t , k denotes the position of the target in the camera coordinate, i.e., x ¯ i t , k = R ( θ i , k ) R c , k ( x t , k x i , k ) . R ( θ i , k ) denotes the yaw angle rotation matrix, and
R ( θ i , k ) = cos ( θ i , k ) sin ( θ i , k ) 0 sin ( θ i , k ) cos ( θ i , k ) 0 0 0 1 .
R c , k denotes the roll and pitch rotation matrix and is assumed to be retrieved from the quadrotor navigation system, and therefore, it is treated as a known variable. The measurement noise is v i , k t N ( 0 , R i t ) . In this paper, target detection is carried out using kernelized correlation filters (KCFs) [36] on the image plane.

5.3. Experiment Results and Analysis

According to the above model description, an experiment with three quadrotors tracking one ground robot on the basis of the UT-CLAT algorithm was carried out at 10 Hz. The experimental setup is shown in Table 2.
One experimental snapshot of the three quadrotors with the corresponding captured images is shown in Figure 10 when the ground robot is within the FOV of all three quadrotor cameras.
According to the CLAT algorithm, the trajectories of the three quadrotors’ self-localization results and target tracking results are plotted in Figure 11. As observed in Figure 11, the three quadrotors are able to localize themselves while stably tracking the target. It is obvious that the self-localization result from quad 1 is better than that of the other two quadrotors as it can obtain the navigation signal from the onboard navigation system. The errors of self-localization and target tracking are plotted in Figure 12 and Figure 13, respectively. The local estimation errors (solid line in colors) and the corresponding approximated ± 3 σ envelopes (dashed lines in the same color) of the aforementioned three quadrotors are plotted. As observed in Figure 12 and Figure 13, the estimation errors by each quadrotor are bounded by the ± 3 σ envelopes in the steady state.

6. Conclusions

A UT-based CLAT method is proposed to realize multi-robot self-localization and target tracking in a distributed fashion. The proposed method is recursive, and only the most recent estimation is stored within each local robot. The communication is limited to the two robots within the relative measurement, and estimation consistency is guaranteed with the covariance split and covariance intersection method. To deal with the nonlinearity in the dynamics models and measurement models, a UT was integrated into the CLAT framework. Both simulation and experimental results show that the proposed method can fulfill the self-localization and target tracking task in practical multi-robot operation scenarios. Future works will focus on the theoretical analysis of the error bounds of both self-localization and target tracking on the basis of different measurement setups.

Author Contributions

Investigation, Y.L.; Methodology, Y.L.; Project administration, Q.P.; Software, J.L.; Supervision, Q.P.

Funding

This work is supported by the National Natural Science Foundation of China under Grant 61603303, 61473230, the Natural Science Foundation of Shaanxi Province under Grant 2017JQ6005, 2017JM6027, the China Postdoctoral Science Foundation under Grant 2017M610650 and the Fundamental Research Funds for the Central Universities under Grant 3102017JQ02011.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Ren, W.; Beard, R.W.; Atkins, E.M. Information consensus in multivehicle cooperative control. IEEE Control Syst. 2007, 27, 71–82. [Google Scholar]
  2. Alonso-Mora, J.; Baker, S.; Rus, D. Multi-robot formation control and object transport in dynamic environments via constrained optimization. Int. J. Robot. Res. 2017, 36, 1000–1021. [Google Scholar] [CrossRef] [Green Version]
  3. Liu, Y.; Nejat, G. Multirobot cooperative learning for semiautonomous control in urban search and rescue applications. J. Field Robot. 2016, 33, 512–536. [Google Scholar] [CrossRef]
  4. La, H.M.; Sheng, W. Distributed sensor fusion for scalar field mapping using mobile sensor networks. IEEE Trans. Cybern. 2013, 43, 766–778. [Google Scholar] [PubMed]
  5. Panzieri, S.; Pascucci, F.; Setola, R. Multirobot localisation using interlaced extended Kalman filter. In Proceedings of the 2006 IEEE/RSJ International Conference on Intelligent Robots and Systems, Beijing, China, 9–15 October 2006; pp. 2816–2821. [Google Scholar]
  6. Chen, L.; Arambel, P.O.; Mehra, R.K. Fusion under unknown correlation-covariance intersection as a special case. In Proceedings of the Fifth International Conference on Information Fusion, Annapolis, MD, USA, 8–11 July 2002; Volume 2, pp. 905–912. [Google Scholar]
  7. Li, H.; Nashashibi, F. Cooperative multi-vehicle localization using split covariance intersection filter. IEEE Intell. Transp. Syst. Mag. 2013, 5, 33–44. [Google Scholar] [CrossRef]
  8. Li, H.; Nashashibi, F.; Yang, M. Split covariance intersection filter: Theory and its application to vehicle localization. IEEE Trans. Intell. Transp. Syst. 2013, 14, 1860–1871. [Google Scholar] [CrossRef]
  9. Luft, L.; Schubert, T.; Roumeliotis, S.I.; Burgard, W. Recursive decentralized localization for multi-robot systems with asynchronous pairwise communication. Int. J. Robot. Res. 2018, 37. [Google Scholar] [CrossRef]
  10. Hu, J.; Xie, L.; Zhang, C. Diffusion Kalman filtering based on covariance intersection. IEEE Trans. Signal Process. 2012, 60, 891–902. [Google Scholar] [CrossRef]
  11. Wang, S.; Ren, W. On the convergence conditions of distributed dynamic state estimation using sensor networks: A unified framework. IEEE Trans. Control Syst. Technol. 2018, 26, 1300–1316. [Google Scholar] [CrossRef]
  12. Wang, S.; Ren, W.; Chen, J. Fully distributed state estimation with multiple model approach. In Proceedings of the 2016 IEEE 55th Conference on Decision and Control (CDC), Las Vegas, NV, USA, 12–14 December 2016; pp. 2920–2925. [Google Scholar]
  13. Wang, S.; Lyu, Y.; Ren, W. Unscented-Transformation-Based Distributed Nonlinear State Estimation: Algorithm, Analysis, and Experiments. IEEE Trans. Control Syst. Technol. 2018, 99, 1–14. [Google Scholar] [CrossRef]
  14. Carrillo-Arce, L.C.; Nerurkar, E.D.; Gordillo, J.L.; Roumeliotis, S.I. Decentralized multi-robot cooperative localization using covariance intersection. In Proceedings of the 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Tokyo, Japan, 3–7 November 2013; pp. 1412–1417. [Google Scholar]
  15. Cunningham, A.; Paluri, M.; Dellaert, F. DDF-SAM: Fully distributed slam using constrained factor graphs. In Proceedings of the 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Taipei, Taiwan, 18–22 October 2010; pp. 3025–3030. [Google Scholar]
  16. Ren, W.; Beard, R.W.; Kingston, D.B. Multi-agent Kalman consensus with relative uncertainty. In Proceedings of the American Control Conference, Portland, OR, USA, 8–10 June 2005; pp. 1865–1870. [Google Scholar]
  17. Farahmand, S.; Roumeliotis, S.I.; Giannakis, G.B. Set-membership constrained particle filter: Distributed adaptation for sensor networks. IEEE Trans. Signal Process. 2011, 59, 4122–4138. [Google Scholar] [CrossRef]
  18. Vaghefi, R.M.; Buehrer, R.M.; Wymeersch, H. Collaborative Sensor Network Localization: Algorithms and Practical Issues. Proc. IEEE 2018, PP, 1–26. [Google Scholar]
  19. Chang, T.K.; Mehta, A. Optimal Scheduling for Resource-Constrained Multirobot Cooperative Localization. IEEE Robot. Autom. Lett. 2018, 3, 1552–1559. [Google Scholar] [CrossRef]
  20. Kia, S.S.; Rounds, S.; Martinez, S. Cooperative Localization for Mobile Agents: A Recursive Decentralized Algorithm Based on Kalman-Filter Decoupling. IEEE Control Syst. 2016, 36, 86–101. [Google Scholar] [Green Version]
  21. Kia, S.S.; Hechtbauer, J.; Gogokhiya, D.; Martínez, S. Server-Assisted Distributed Cooperative Localization Over Unreliable Communication Links. IEEE Trans. Robot. 2017, 99, 1–8. [Google Scholar] [CrossRef]
  22. Chong, C.Y.; Chang, K.C.; Mori, S. A Review of Forty Years of Distributed Estimation. In Proceedings of the 2018 21st International Conference on Information Fusion (FUSION), Bonn, Germany, 10–12 October 2018; pp. 1–8. [Google Scholar]
  23. Battistelli, G.; Chisci, L.; Selvi, D. A distributed Kalman filter with event-triggered communication and guaranteed stability. Automatica 2018, 93, 75–82. [Google Scholar] [CrossRef]
  24. Battistelli, G.; Chisci, L.; Mugnai, G.; Farina, A.; Graziano, A. Consensus-based linear and nonlinear filtering. IEEE Trans. Autom. Control 2015, 60, 1410–1415. [Google Scholar] [CrossRef]
  25. Battistelli, G.; Chisci, L. Stability of consensus extended Kalman filter for distributed state estimation. Automatica 2016, 68, 169–178. [Google Scholar] [CrossRef]
  26. Li, W.; Wei, G.; Han, F.; Liu, Y. Weighted average consensus-based unscented Kalman filtering. IEEE Trans. Cybern. 2016, 46, 558–567. [Google Scholar] [CrossRef] [PubMed]
  27. Ajgl, J.; Straka, O. Covariance Intersection in Track-to-Track Fusion: Comparison of Fusion Configurations. IEEE Trans. Ind. Inform. 2018, 14, 1127–1136. [Google Scholar] [CrossRef]
  28. Ahmad, A.; Tipaldi, G.D.; Lima, P.; Burgard, W. Cooperative robot localization and target tracking based on least squares minimization. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation (ICRA), Karlsruhe, Germany, 6–10 May 2013; pp. 5696–5701. [Google Scholar]
  29. Huang, G.; Truax, R.; Kaess, M.; Leonard, J.J. Unscented iSAM: A consistent incremental solution to cooperative localization and target tracking. In Proceedings of the 2013 European Conference on Mobile Robots (ECMR), Barcelona, Spain, 25–27 September 2013; pp. 248–254. [Google Scholar]
  30. Morbidi, F.; Mariottini, G.L. Active target tracking and cooperative localization for teams of aerial vehicles. IEEE Trans. Control Syst. Technol. 2013, 21, 1694–1707. [Google Scholar] [CrossRef]
  31. Meyer, F.; Hlinka, O.; Wymeersch, H.; Riegler, E.; Hlawatsch, F. Distributed Localization and Tracking of Mobile Networks Including Noncooperative Objects. IEEE Trans. Signal Inf. Process. Netw. 2016, 2, 57–71. [Google Scholar] [CrossRef]
  32. Zhou, B.; Chen, Q.; Xiao, P. The error propagation analysis of the received signal strength-based simultaneous localization and tracking in wireless sensor networks. IEEE Trans. Inf. Theory 2017, 63, 3983–4007. [Google Scholar] [CrossRef]
  33. Huang, G.P.; Roumeliotis, S.I. An Observability Constrained UKF for Improving SLAM Consistency; Tech. Rep.; University of Minnesota: Minneapolis, MN, USA, 2008. [Google Scholar]
  34. Zhu, J.; Kia, S.S. Consistent loosely coupled decentralized cooperative navigation for team of mobile agents. In Proceedings of the ION’s International Technical Meeting, Monterey, CA, USA, 30 January–2 February 2017. [Google Scholar]
  35. Chakraborty, A.; Misra, S.; Sharma, R.; Taylor, C.N. Observability Conditions for Switching Sensing Topology for Cooperative Localization. Unmanned Syst. 2017, 5, 141–157. [Google Scholar] [CrossRef]
  36. Henriques, J.F.; Caseiro, R.; Martins, P.; Batista, J. High-speed tracking with kernelized correlation filters. IEEE Trans. Pattern Anal. Mach. Intell. 2015, 37, 583–596. [Google Scholar] [CrossRef] [PubMed]
Figure 1. Simulation with four local robots and one moving target.
Figure 1. Simulation with four local robots and one moving target.
Applsci 09 00903 g001
Figure 2. Measurement and communication link availability between two robots with r c = 10 .
Figure 2. Measurement and communication link availability between two robots with r c = 10 .
Applsci 09 00903 g002
Figure 3. Measurement availability of target to four robots with r t = 20 .
Figure 3. Measurement availability of target to four robots with r t = 20 .
Applsci 09 00903 g003
Figure 4. Estimated trajectories of robots and the target in different colors (black dashed lines indicate the ground truth).
Figure 4. Estimated trajectories of robots and the target in different colors (black dashed lines indicate the ground truth).
Applsci 09 00903 g004
Figure 5. Self-localization errors and covariances of robots 1–4.
Figure 5. Self-localization errors and covariances of robots 1–4.
Applsci 09 00903 g005
Figure 6. Target tracking errors and covariance of robots 1–4.
Figure 6. Target tracking errors and covariance of robots 1–4.
Applsci 09 00903 g006
Figure 7. Self-localization estimation position root-mean-square errors (PRMSEs) of the unscented transformation-based collaborative self-localization and target tracking scheme (UT-CLAT) vs. the extended Kalman filter-based CLAT (EKF-CLAT) for robots 1–4.
Figure 7. Self-localization estimation position root-mean-square errors (PRMSEs) of the unscented transformation-based collaborative self-localization and target tracking scheme (UT-CLAT) vs. the extended Kalman filter-based CLAT (EKF-CLAT) for robots 1–4.
Applsci 09 00903 g007
Figure 8. Target distributed estimation PRMSEs of the UT-CLAT vs. the EKF-CLAT for robots 1–4.
Figure 8. Target distributed estimation PRMSEs of the UT-CLAT vs. the EKF-CLAT for robots 1–4.
Applsci 09 00903 g008
Figure 9. Intel Aero RTF quadrotors (equipped with an onboard navigation system, ultra-wide bandwidth (UWB) transmitters, and downward cameras) and the TurtleBot ground robot.
Figure 9. Intel Aero RTF quadrotors (equipped with an onboard navigation system, ultra-wide bandwidth (UWB) transmitters, and downward cameras) and the TurtleBot ground robot.
Applsci 09 00903 g009
Figure 10. Snapshot of the CLAT experiment setup (three quadrotors and corresponding captured image).
Figure 10. Snapshot of the CLAT experiment setup (three quadrotors and corresponding captured image).
Applsci 09 00903 g010
Figure 11. Trajectories of three quadrotors’ self-localization results and target tracking results with different colors. Ground truth is indicated by black lines.
Figure 11. Trajectories of three quadrotors’ self-localization results and target tracking results with different colors. Ground truth is indicated by black lines.
Applsci 09 00903 g011
Figure 12. The self-localization errors and covariance of three quadrotors.
Figure 12. The self-localization errors and covariance of three quadrotors.
Applsci 09 00903 g012
Figure 13. Object tracking errors and covariance of three quadrotors.
Figure 13. Object tracking errors and covariance of three quadrotors.
Applsci 09 00903 g013
Table 1. Self-localization and target tracking errors ( k [ 200 , 800 ] ).
Table 1. Self-localization and target tracking errors ( k [ 200 , 800 ] ).
Absolute Self-Localization Error (min/max)Absolute Target Tracking Error (min/max)
x(m)y(m) θ (rad)x(m)y(m) θ (rad)
robot 10.05/0.350.03/0.410/0.080.03/0.50.03/0.660.01/0.65
robot 20.04/0.940.1/1.130/0.110.04/0.540.05/0.540.01/0.71
robot 30.01/1.310.12/0.960/0.070.02/0.610.05/0.470/0.72
robot 40.02/1.080.04/1.240/0.120.04/0.440.03/0.550/0.75
Table 2. Experiment setup.
Table 2. Experiment setup.
ItemQuantity
robot setupcircular center (in meters):
c 1 = [ 5 , 5 , 15 ] , c 2 = [ 5 , 5 , 16.5 ]
c 3 = [ 5 , 5 , 18 ]
control input:
v i = 0.35 m/s, ω i = 0.035 rad/s
Q i v = 0.05 2 , Q i w = ( π / 180 ) 2 , Q i z = 0.1 2
initial state:
P i , 0 = diag ( [ 1 2 , 1 2 , 0.5 2 , ( 10 π / 180 ) 2 ] )
x 1 , 0 = [ 8.5 , 11.5 , 15 , 2.35 ] ,
x 2 , 0 = [ 10 , 11 , 16.5 , 0.53 ] ,
x 3 , 0 = [ 1 , 1 , 18 , 0.78 ]
target setupcontrol input:
v i = 0.2 m/s, ω i = 0 rad/s
Q t v = 0.02 2 , Q t ω = ( 0.5 π / 180 ) 2 , Q t z = 0.05 2
initial state:
P t i , 0 = diag ( [ 0.1 2 , 0.1 2 , 0.5 2 , ( π / 180 ) 2 ] ) ,
x t i , 0 = [ 15 , 15 , 0 , 0.785 ]
measurement setup R a = diag ( [ 0.2 2 , 0.2 2 , 0.1 2 ] ) ,
R c = 0.1 2 , R t = diag ( [ 5 2 , 5 2 ] )

Share and Cite

MDPI and ACS Style

Lyu, Y.; Pan, Q.; Lv, J. Unscented Transformation-Based Multi-Robot Collaborative Self-Localization and Distributed Target Tracking. Appl. Sci. 2019, 9, 903. https://doi.org/10.3390/app9050903

AMA Style

Lyu Y, Pan Q, Lv J. Unscented Transformation-Based Multi-Robot Collaborative Self-Localization and Distributed Target Tracking. Applied Sciences. 2019; 9(5):903. https://doi.org/10.3390/app9050903

Chicago/Turabian Style

Lyu, Yang, Quan Pan, and Jian Lv. 2019. "Unscented Transformation-Based Multi-Robot Collaborative Self-Localization and Distributed Target Tracking" Applied Sciences 9, no. 5: 903. https://doi.org/10.3390/app9050903

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop