Development of An Autonomous Surface Vehicle and Performance Evalu-Ation of Autonomous Navigation Technologies

You might also like

Download as pdf or txt
Download as pdf or txt
You are on page 1of 11

International Journal of Control, Automation and Systems 18(3) (2020) 535-545 ISSN:1598-6446 eISSN:2005-4092

http://dx.doi.org/10.1007/s12555-019-0686-0 http://www.springer.com/12555

Development of an Autonomous Surface Vehicle and Performance Evalu-


ation of Autonomous Navigation Technologies
Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi* 

Abstract: The use of autonomous marine robots has been rapidly increasing in the development of marine environ-
ments. This paper presents the development of an autonomous surface vehicle (ASV) and validation of autonomous
navigation technologies. The ASV was developed as a testbed to validate fundamental navigation technologies for
autonomous marine robots including both surface and underwater vehicles. The ASV was developed on a catama-
ran by integrating various sensors and power and electrical propulsion systems, navigation and control systems, and
communication devices. As fundamental navigation technologies for ASV, waypoint tracking and obstacle avoid-
ance are developed and tested. Further, using the ASV as a testbed to validate underwater navigation technologies,
two types of underwater localization methods were developed. First, an acoustic-based navigation was developed
by using acoustic sources as landmarks in underwater environment. The proposed acoustic-based navigation local-
ized both vehicle and source by Kalman filter-based SLAM. Second, terrain-based localization as geophysics-based
navigation was developed using a particle filter. Effective resampling can be achieved by using a measurement of
terrain roughness. Both acoustic and terrain-based underwater navigation methods are implemented with the devel-
oped ASV, and the performance of the navigation methods are evaluated by comparing the estimated localization
results to the ground truth acquired by GPS. Several field tests conducted in inland water environments demonstrate
the performance of the developed vehicle and navigation algorithms.

Keywords: Acoustic based navigation, autonomous surface vehicle, marine robot, terrain based localization.

1. INTRODUCTION A mothership was used to support the operation of the


ROV and the vehicle was operated by tele-operation with
Over the past several decades, demands for the devel- wired connection between the ROV and the mothership.
opment of the marine environment have been rapidly in- Recent research trends regarding the development of ma-
creasing. Marine environment has considerable possibil- rine robots emphasize on autonomous robots [8,9]. By de-
ities of development because it covers over 70% of the veloping autonomous marine robotic systems, the robot
surface area of the Earth and contains many important re- can perform its tasks without the intervention of an op-
sources. Thus, many countries attempt to develop and pro- erator. AUVs have been developed and used to perform
tect their own marine territories. Recently, various types underwater tasks, and ASVs have been used to perform
of marine robotic systems have been developed and uti- surface tasks. Furthermore, the cooperation of surface ve-
lized for the development of the marine environment. Re- hicles and underwater vehicles is also used to perform
motely operated vehicles (ROVs) and autonomous under- marine tasks [10]. It can dramatically reduce the opera-
water vehicles (AUVs) are widely used for underwater tion cost because the surface vehicle can replace support-
applications such as environmental survey and resource ing vessel for the operation of underwater vehicles. Un-
management [1–4]. Moreover, autonomous surface vehi- derwater vehicles can be launched and recovered by an
cles (ASVs) also have been developed to perform marine autonomous surface vehicle so that complete autonomous
tasks that can be performed on the surface of the water operation of marine robotic systems can be achieved [11].
such as maritime surveillance and reconnaissance [5–7]. Autonomous navigation technology is an essential ca-
The operation of marine robots, especially in the un- pability of such autonomous marine robots. Autonomous
derwater environment, was mainly performed by ROVs. navigation capabilities including mapping, localization,

Manuscript received August 19, 2019; revised November 13, 2019; accepted November 23, 2019. Recommended by Associate Editor
Son-Cheol Yu under the direction of Editor-in-Chief Keum-Shik Hong. This research was supported by a grant from Endowment Projects of
“Development of core technology for cooperative navigation of multiple marine robots and underwater wireless cognitive network” funded
by Korea Research Institute of Ships and Ocean engineering.

Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi are with Ocean System Engineering Research Division,
Korea Research Institute of Ships and Ocean Engineering (KRISO), Daejeon 34103, Korea (e-mails: {jwchoi, jeonghong, jdjung, yglee,
htchoi}@kriso.re.kr).
* Corresponding author.

ICROS,
c KIEE and Springer 2020
536 Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi

and guidance and control should be developed and inte- ods have also been developed by applying robotics tech-
grated for a fully-autonomous operation of marine robots. nologies such as simultaneous localization and mapping
The robot should recognize environmental entities such (SLAM) [13, 14]. Our acoustic-based navigation is based
as obstacles and bathymetric maps using its onboard sen- on the concept of inverted-USBL [15]. We assume that
sors, and it also should perform self-localization using an acoustic source is located in an underwater environ-
the geometric information of environmental entities. Con- ment and it transmits an acoustic signal repeatedly. The
sidering the localization problem of autonomous marine ASV equipped with signal acquisition system receives the
robots, the use of sensors is limited underwater. Most un- transmitted acoustic signal. Then, extended Kalman filter
derwater sensors rely on the use of acoustic signal such (EKF)-based SLAM is performed to localize the vehicle
as Doppler velocity log (DVL), multi-beam echo sounder without any prior information of an acoustic source loca-
(MBES), and side-scan sonar. On the other hand, surface tion [16].
vehicles can acquire the absolute location easier than un- The second tested underwater navigation method is
derwater vehicles because of the global navigation satel- terrain-based localization. Bathymetric measurements are
lite system (GNSS). However, when GNSS is denied or useful information both in underwater and surface navi-
interfered with, the surface vehicle needs to perform lo- gation when GNSS is denied [17–20] as mentioned. The
calization with onboard sensors such as optical cameras, developed ASV equipped with a multibeam echo sounder
Lidar, and so on. In such a case, underwater navigation can obtain an array of bathymetric measurements, which
technologies can be helpful for the localization of surface can be used in the localization with pre-surveyed terrain
vehicles. maps. In this paper, terrain-based navigation (TBN) us-
This paper aims to develop fundamental technologies to ing sonar multibeam measurements is proposed and im-
implement autonomous marine robot systems. It involves plemented within a particle filter (PF) framework [16]. By
two main parts: 1) the development of an ASV, and 2) the employing terrain roughness measures, a standard particle
validation of underwater navigation technologies using the filter framework is modified to resolve the particle impov-
developed ASV. The ASV is developed to test the guid- erishment problem that occurs around areas with a smooth
ance, navigation, and control algorithms in the surface en- terrain.
vironment. Fundamental technologies for the ASV such as Fig. 1 shows an overview of the contents of this paper.
waypoint tracking and obstacle avoidance are developed As shown, we first develop an ASV and it has two main
and tested. Along with its own purposes as a surface ve- purposes: development of autonomous navigation tech-
hicle, the ASV is used as a testbed for the validation of nologies for an ASV and a testbed for validation of the
underwater navigation methods. Because GPS is available underwater navigation technologies.
for the ASV, it is used as a reference position to validate This paper describes the abovementioned fundamental
underwater navigation algorithms that are performed us- technologies for the development of autonomous marine
ing underwater sensor data. In this paper, two types of un- robotic system. The system configuration and algorithm of
derwater navigation methods – acoustic-based navigation each method will be described. The presented methods are
and terrain-based navigation – are developed and tested. implemented and validated with the developed ASV. The
The ASV is designed as a catamaran to maintain ma- remainder of this paper is organized as follows. Section
neuvering stability and to minimize a distortion of under- 2 presents the details of the developed autonomous sur-
water information caused by the motion information of face vehicle. Section 3 describes the acoustic-based under-
the ASV. The ASV is required to achieve a large flexible water navigation method. Section 4 describes the terrain-
payload for mounting a range of system components in- based underwater navigation. Section 5 shows experimen-
cluding the guidance, navigation and control system, elec- tal results of the field tests of the developed system and
trical power and propulsion system, wireless communica-
tion devices, and the underwater navigation system. In ad-
dition, for autonomously achieving underwater informa-
tion gathering tasks, the fundamental autonomous navi-
gation capabilities of the ASV were implemented. Way-
point tracking and obstacle avoidance approaches are im-
plemented as essential maneuvering capabilities for au-
tonomous navigation in the on-board system.
The first underwater navigation method tested by the
ASV is acoustic-based navigation; this is one of the most
essential underwater navigation methods. Conventional Fig. 1. Development of an ASV and its purposes: devel-
methods such as long baseline (LBL) and ultrashort base- opment of autonomous navigation technologies for
line (USBL) are widely used to localize underwater ve- surface vehicles and the testbed for the validation
hicles and moving targets [12]. Several advanced meth- of underwater navigation technologies.
Development of an Autonomous Surface Vehicle and Performance Evaluation of Autonomous Navigation ... 537

navigation methods. Fianlly, Section 6 presents the con-


clusion and future directions.

2. DEVELOPMENT OF AUTONOMOUS
SURFACE VEHICLE

2.1. Hardware configuration


The ASV platform is developed based on a catamaran
(length: 4.1 m; width: 2.4 m). In particular, the vehicle
is integrated with various component systems, including
electrical thrusters and power, electronic sensors and de-
vices, on-board computers, and wireless communication
systems, as shown in Fig. 2. Fig. 3. Hardware connections.
Twin electric outboard thrusters are mounted at the
stern of each hull. For supplying electrical power, three
high-performance lithium batteries are installed. Each Table 1. Acoustic devices and operating frequencies.
battery module includes a battery management system
Model Frequency
(BMS) and its capacity is determined considering the op-
MBES Imagenex Model 837B 260 kHz
erating hours of the vehicle. To measure the motion in-
DVL Teledyne RDI Explorer 600 kHz
formation of the vehicle in real-time, a GPS-compass, an
Acoustic Modem Subnero Unet modem 18-36kHz
attitude heading reference system (AHRS), and a fiber op-
tic gyro (FOG) are mounted. As a situational awareness
system, optical sensors (e.g., stereo camera and Lidar) are sors. These three acoustic devices use different operating
used to detect objects floating on the water. Wireless local frequencies that do not overlap, and therefore, they can be
area networks using wireless fidelity and RF devices are used simultaneously without interference.
deployed to reciprocally communicate an operation com-
mand and the current state of the vehicle. Furthermore, for
2.2. Autonomous navigation system
preventing emergencies, a wireless remote stop and on-
board kill switches are configured as an emergency sys- For autonomously achieving various tasks, autonomous
tem. Details on these hardware connections for each sen- navigation approaches for tracking the preassigned way-
sor and device component are illustrated in Fig. 3. points and for avoiding objects on the water are funda-
The developed ASV is equipped with three acoustic mentally required. A closed-loop controller is applied to
sensors: MBES, DVL, and acoustic modem. Table 1 lists control the course of the vehicle toward the goal waypoint.
the models and operating frequency of these acoustic sen- For a collision-free path with a stationary object, a path
planning approach is implemented.

2.2.1 Waypoint guidance and control approach


Waypoints are preferentially assigned according to the
tasks to be performed and they can be automatically gen-
erated by a path planner – a module for collision-free
path planning during the tasks. Since the vehicle is de-
veloped as a nonholonomic system, its motion model for
guidance and control approaches is simplified as a three
degree-of-freedom (3-DOF) kinematic model. In addition,
the guidance approach for minimizing the line-of-sight
(LOS) and cross-track errors is employed. The conven-
tional proportional-derivative (PD) controller is designed
and implemented to control the course of the vehicle to-
ward the goal waypoints. During task activation, a control
input (δτ ) of each thruster is determined by the LOS and
cross-track guidance can be expressed as
Fig. 2. ASV platform designed by KRISO. Various sen-
p d p d ˙
sors and devices mounted for autonomous naviga- δτ = ρ(klos ψe + klos ψ̇e ) + (1 − ρ)(kcte dcte + kcte dcte ).
tion of the vehicle. (1)
538 Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi

p d
Here, klos and klos are the proportional and differential gain horizontal plane. For considering the uncertainty informa-
p
coefficients for the LOS guidance, respectively, and kcte tion and predicted trajectory for each object, the collision
d
and kcte are the proportional and differential gain coeffi- risk evaluation approach proposed in [22] is applied in
cients for the cross-track guidance, respectively. The con- this study. For the efficient computation of the collision
trol gains include the meaning of the transfer coefficient risk, a safe separation zone and uncertainty with respect
that adjusts each unit. The variables ψe and ψ̇e denote to each object are respectively combined through coor-
the heading angle error of the vehicle and its differential dinate transformation. Considering the combined uncer-
value, and de and d˙e represent the cross-track error and its tainty and the combined safe boundary zone as a circular
differential value, respectively. Moreover, ρ is defined as shape around the center position of each object, for com-
the ratio of the distance to the current goal waypoint from puting a collision probability over the time interval [t0 ,t]
the vehicle position to the distance between the current as a quantitative collision risk, the collision probability at
and the previous goal waypoints. If ρ is larger than 1, ρ time t can be expressed as
is set to 1. Accordingly, the weighting of each guidance Z t
approach is adjusted using ρ. Pic (t) = Pic (t0 ) + Ṗic (τ)dτ, (2)
t0

2.2.2 Collision avoidance approach


where Ṗic (t) is the rate of change of uncertainty through
A reliable collision avoidance scheme is an essential the boundary of the combined safe separation zone (For
capability for the autonomous navigation of a vehicle. more details refer to [22]).
The scheme consists of three modules: evaluation of col- In the collision-free path planning module, areas where
lision risk module, collision-free path planning module, there exists a likelihood of collision between the vehicle
and guidance and control module, as shown in Fig. 4. We and an object in a horizontal plane are classified as col-
adopted the collision avoidance scheme from the author’s lision risk zones (CRZs) during the trajectory prediction
previous study [21], wherein the method was verified via process. In the previous module, if the evaluated collision
numerical simulations. In this study, the collision avoid- risk is exceeded over a predefined criterion, CRZ is con-
ance scheme is implemented in the real system. In this figured on the grid map in the horizontal plane. In particu-
scheme, for estimating the motion information of the de- lar, the approximated rectangular boundary including the
tected object, the position information acquired from the boundary of CRZ is extracted for the simplification of the
GPS of the object is used, and the relative measurement in- process. Two points in each corner of the approximated
formation is calculated. Herein, the measured information rectangular are extracted as local waypoints for collision
includes an uncertainty caused by the inherent measure- avoidance. Subsequently, the collision-free path passing
ment characteristics of each sensor. Hence, the quantita- through the feature points is then generated by the Dubins
tive collision risk between the ASV and objects is eval- curve approach [23] considering the turning radius of the
uated by a probabilistic approach, and the collision-free vehicle.
path is planned with the minimum turning radius of the For following the planned collision-free path, the way-
vehicle. point guidance and control approach proposed in this
In the evaluation of a collision risk module, the trajec- study is applied in the guidance and control module.
tory for each object is predicted over a prespecified time Through iterative field tests, the controller gains are tuned
horizon in the future. For this purpose, the position, ve- to maintain stable performance against disturbances.
locity, and courses of each object are used. In addition,
the uncertainty for each estimated information can be rep-
resented using a probability density function under the 3. ACOUSTIC-BASED NAVIGATION
assumption of a multivariate Gaussian distribution in a
The first method validated with the ASV is acoustic-
based navigation. Our acoustic-based navigation method
utilizes acoustic sources as underwater landmarks. We as-
sume that acoustic sources located in the underwater envi-
ronment are staionary and transmit specific acoustic sig-
nals repeatedly. The vehicle is equipped with a signal
acquisition system that consists of several hydrophones
to estimate the relative range and bearing information of
the acoustic source. The estimated acoustic source infor-
mation is used to perform underwater localization. EKF-
based SLAM is performed by fusing inertial sensors with
Fig. 4. Collision avoidance scheme of the ASV with re- the acoustic information to localize the vehicle without
spect to objects. prior information of source locations.
Development of an Autonomous Surface Vehicle and Performance Evaluation of Autonomous Navigation ... 539

3.1. System configuration nal and is used for bearing estimation. The bearing is es-
timated by the time difference of arrivals (TDOA) of two
The acoustic signal processing system is developed
acoustic signals acquired by a pair of hydrophones.
based on a conventional acoustic modem of Unet mo-
dem from Subnero in Singapore [24]. The Unet under-
water acoustic modem is fundamentally used for under- 3.2. EKF SLAM using acoustic signal
water communication. Therefore, it has basic functions of Fig. 6 shows the acoustic-based navigation method us-
acoustic signal transmission and acquisition. Furthermore, ing acoustic source. The typical acoustic modem is used
it provides ranging function between two modems. The as the acoustic source which transmit a specific acous-
Unet modem provides both one-way and two-way rang- tic signal. The vehicle equipped with the custom modem
ing functions. receives the transmitted signal and estimates the relative
The proposed acoustic-based navigation uses the typi- geometric information of the source. First, the range in-
cal modem as an acoustic source. The acoustic modem is formation between the vehicle and the acoustic source is
installed in an underwater environment and it transmits a acquired by one-way ranging. We use one-way ranging
specific acoustic signal so that it can be used as an artifi- method instead of two-way ranging to perform localiza-
cial landmark in the underwater environment. Moreover, tion processes more frequently. The range information can
a customized modem is developed for the signal acquisi- be acquired simply by using the clock difference between
tion system of the transmitted acoustic signal. Based on the transmission and receiving times because both clocks
the typical Unet modem, we customized the modem by are synchronized in the initialization step. Then, the bear-
attaching 4 B&K 8103 additional hydrophones. The ad- ing is estimated by TDOA of two acoustic signals acquired
ditional hydrophones are used to estimate bearing infor- by a pair of hydrophones. When two hydrophones receive
mation. The developed acoustic modem is installed in the the acoustic signal transmitted by a source, then we can
ASV and used to estimate the relative range and bearing detect the signal in the received two acoustic signals with
of the landmark modem. The acquisition of the relative a specific time delay (δt ). By using the TDOA, the direc-
geometric information of the acoustic source is similar to tional angle of the acoustic source can be acquired as
the concept of USBL.
θs = cos−1 (c · δt /d), (3)
Fig. 5 shows the conceptual and real images of the de-
veloped underwater acoustic localization system. In the where c and d represent the speed of sound underwater
real image, the right modem shows the developed modem and the spacing between two hydrophones as shown in
with additional hydrophones and the left one shows the Fig. 6, respectively.
typical modem used as an acoustic source, respectively.
The estimation of bearing information is achieved by
As mentioned, the acoustic source is used as a landmark in
a probabilistic method. The time delay between the two
underwater environments for the autonomous navigation
acoustic signals is represented by a probability density
of the vehicle. Two modems perform clock synchroniza-
function. Then, it is recursively calculated by a Bayesian
tion by using two-way ranging at the beginning of local-
update process. The motion model for the probability cal-
ization. After clock synchronization, the landmark modem
culation was used as motion of the vehicle (us ), and the
transmits a specific signal for source localization, and the
custom modem is used as a receiver to localize both the
vehicle and the source. The signal comprises three parts:
preamble, header, and data. The data part is a chirp sig-

Fig. 5. Acoustic modem-based underwater localization


system. Left: a pair of typical and custom modems, Fig. 6. Acoustic-based navigation using range and bearing
and Right: conceptual drawings of custom modem. information of acoustic source.
540 Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi

measurement model was used by the generalized cross 4. TERRAIN-BASED NAVIGATION


correlation of the current acoustic signals (zs ) [25].
This section describes our second underwater naviga-
P(δt = τ|zs1:t , us1:t ) tion method. In particular, terrain-based localization using
= η · P(zst |δt = τ)P(δt = τ|zs1:t−1 , us1:t ). (4) multibeam sonar observation is proposed. We assume that
the terrain map of the underwater environment is obtained
The detailed explanations for each parameter and direc- through a pre-survey.
tion estimation can be found in our previous literature
[26]. 4.1. Design of TBN filter
The localization process of the proposed acoustic- The navigation filter used for the proposed terrain-based
based underwater navigation is performed by EKF-based localization follows a standard framework of sequential
SLAM. It fuses inertial sensors of the vehicle and geo- importance resampling (SIR) particle filter [16, 27]. It
metric information of the acoustic source to localize both maintains a set of N pose hypotheses, i.e., particles Xt =
the vehicle and acoustic source. The state vector of EKF- (i)
{xt |i = 1, . . . , N}. This particle set realizes the posterior
SLAM is defined as probabilities of the target state xt by a set of weights Wt =
(i)
x(t) = [xv (t), xs (t)] , (5) {wt |i = 1, . . . , N}. The process consists of three steps:
motion update, weight update, and resampling. These
where xv is the state vector of the vehicle pose, and xs steps are performed based on the designed vehicle mo-
is the state vector of the acoustic source location, respec- tion and sensor observation models, which are explained
tively. in detail in the following sections.
The state vector of the vehicle pose is defined as
4.1.1 Motion update
xv = [x y z φ θ ψ u v w] , (6)
In this step, particles are moved and dispersed accord-
where the first six variables represent the position and at- ing to the vehicle motion model. We employ the velocity
titude of the vehicle and the last three represent the linear motion model, that assumes vehicle motion is controlled
velocity in the body frame. by two velocities, a linear velocity vt and a rotational ve-
EKF SLAM is performed by two steps which are pre- locity ωt . The motion sensors used in the proposed TBN
diction and correction steps. First, the prediction step is are DVL and IMU, which provide measurements of vt and
performed using an inertial measurement unit (IMU) and ωt , respectively. This control input is applied to each par-
DVL. It calculates the current vehicle pose based on the ticle in a probabilistic manner and it realizes uncertainty
kinematic model of the vehicle. in motion prediction. We first sample a control input and
an additional heading perturbation term γ̂ as
x̂(t) = f (x(t − 1), ut ), (7)
v̂ = vt + N (0, α1 vt2 + α2 ωt2 ), (10)
where x̂ is the state vector of EKF SLAM estimation, f is
the motion model of the vehicle, and u is the control input, ω̂ = ωt + N (0, α3 v + α4 ωt2 ),
2
(11)
which is acquired by IMU and DVL (8). γ̂ = N (0, α5 vt2 + α6 ωt2 ), (12)

û(t) = [vt at ωt ] , (8) where N (0, σ ) is a sampled value from the normal dis-
tribution with zero mean and standard deviation σ . The
where v is linear velocity, a is acceleration, and ω is rota- variables α1 to α6 are the parameters of the motion noise.
tional velocity of the vehicle, respectively. α1 and α2 introduce how much uncertainty in the mea-
Then, in the correction step, the state of SLAM esti- surement of linear velocity grows with current linear and
mation which consists of vehicle and source locations is angular velocity, respectively, and α3 and α4 similarly es-
updated by using the acoustic measurement. tablish the uncertainty in angular velocity.
ẑ(t) = [rs (t), θs (t)], (9) The vehicle pose is then updated by following equa-
tions:
where rs and θs are the range and bearing measurements (i) (i) (i)
for the acoustic source. The correction step updates the xt+1 = xt + ∆xt , (13)
locations of the vehicle and landmark modem. The EKF
 ν̂ (i) (i) 
− ω̂ sin(ψt ) + ω̂ν̂ sin(ψt + ω̂∆t)
SLAM estimation can provide the simultaneous localiza- (i)  ν̂ cos(ψ (i) ) − ν̂ cos(ψ (i) + ω̂∆t) 
∆xt =  t t , (14)
tion of both the vehicle and the source by performing  ω̂ ω̂
N (0, σz ) 
the above processes recursively. Therefore, the proposed ω̂∆t + γ̂∆t
acoustic-based navigation can successfully perform un-
derwater vehicle localization without any prior informa- where σz is the disturbance in the z direction motion of the
tion of the source location. vehicle owing to the wave.
Development of an Autonomous Surface Vehicle and Performance Evaluation of Autonomous Navigation ... 541

4.1.2 Weight update


In this step, the weight of each particle is updated
based on the actual sonar range measurement and pre-
dicted range calculated from an observation model. Two
kinds of observation models, which are projection-based
and range-based, are generally used [18]. In the propose
method, we exploit the range-based model because it is
more informative in the case of multibeam observations.
The sonar range is predicted by casting a ray in the beam
direction and by finding a hit point in the terrain map. As
the number of beams used in the multibeam sonar sens-
ing is several hundreds, efficient ray casing is required. Fig. 7. Multibeam sonar range observation with ray cast-
Therefore, we employed a region of interest (ROI) to re- ing.
strain the search area for ray casting (Fig. 7). The ROI is
set as a bounding box centered and oriented with the cur-
rent pose with a pre-defined width and height to cover the
maximum roll and pitch of the vehicle.
Once the range is predicted, the particle weight can be
updated based on the following equation:
n  2 
(i) (i) 1 1  (i)
wt = wt−1 ∏ √ exp − 2 rk − rk ,
k=1 2πσr 2σr
(15)

where n is the number of sonar beams in a single scan,


(i)
rk is the estimated range between the i-th particle and the
terrain through the k-th beam, rk is the actual range mea-
surement of the k-th beam, and σr2 is the noise covariance
of range measurements.
Unfortunately, when the underwater terrain is flat, con-
ventional filter results in a particle impoverishment prob-
lem due to the lack of information. To resolve this prob-
lem, terrain roughness Rz from each sonar scan is calcu- Fig. 8. Terrain smoothness along the ASV trajectory.
lated as
and navigation methods. During the field tests, onboard
1
Rz = Σqi=1 (zpeak,i − zvalley,i ), (16) GPS was used in the satellite-based augmentation system
q
(SBAS) mode. The accuracy of the SBAS-GPS was 0.3 m.
where zpeak and zvalley are the i-th highest peak and lowest
valley respectively, and q is the number of z values used. 5.1. Performance tests for the developed ASV
Then, we modified the weight update and resampling First, we performed several typical performance tests.
procedures to adapt based on the Rz values. With smaller As a basic performance of the vehicle, the maximum
Rz , the sensor covariance used in the weight update is se- speed was measured as 6.35 knots and the turn radius was
lectively assigned with larger values [28], and resampling 11.75 m at the maximum speed. Field tests to validate the
frequency is restrained. Fig. 8 shows the terrain smooth- implemented waypoint guidance and control algorithms
ness (1/Rz ) along the vehicle trajectory for the test site. were also conducted. Fig. 9 shows the performance for
The proposed filter adaption method is applied to the area the guidance and control of the vehicle. In this test, the
with 1/Rz larger than a certain threshold value (shown in cruising speed of the vehicle was set to be 3 knots and the
yellow and red). Therefore, the proposed TBN method can acceptance radius at each waypoint was given as 10 m.
perform localization processes effectively. As a result, the robot followed the given waypoints with
1.237 m root mean square cross-track error.
5. FIELD EXPERIMENTS To validate the practical feasibility of the proposed
scheme for collision avoidance between the vehicle and an
This section presents experimental results. Several field object, the course of the vehicle was set to be toward the
tests were carried out in an inland water environment surface object. In this test, we assumed that the position
to demonstrate the performances of the developed ASV of the obstacle was already known and measured by GPS.
542 Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi

(a) (b)

Fig. 11. Results of the collision avoidance test: (a) The tra-
jectory of the vehicle and the generated collision-
free waypoints; (b) Results of the evaluated col-
lision risk, the variation of the heading angle of
Fig. 9. Result of waypoint guidance and control approach the vehicle, and the relative range between two
for validating the performance of the developed objects.
ASV.

(a) (b) (c)

Fig. 10. Snapshot images for the field test process of the
proposed collision avoidance scheme with a sta-
tionary object: (a) Approaching the object; (b)
Collision evasive maneuver; (c) Returning to the
goal point.

The probabilistic collision risk was periodically evaluated


for a 30 s time horizon with a 0.1 s interval, and the thresh-
old value for initiating the collision evasive maneuver was Fig. 12. Experimental result of acoustic-based SLAM.
set to 30%. Fig. 10 shows the field test processes of colli- Black and red lines represent the estimated vehi-
sion avoidance scheme implemented in the vehicle. When cle locations of dead-reckoning and EKF SLAM,
the evaluated collision risk reached the predefined thresh- respectively. Blue dots represent reference vehi-
old value, a collision-free path was planned and the colli- cle location acquired from GPS.
sion evasive maneuver was initiated, as shown in Fig. 11.
As a result, the path was well generated and tracked, with-
out any violation between the vehicle and the stationary ically transmitted acoustic signals, which consist of a
object. frame with current time clock for one-way ranging and a
chirp signal for bearing estimation, every 10 s. The vehicle
5.2. Performance tests of acoustic-based navigation moved along a given path by waypoint tracking and per-
For the performance test of acoustic-based navigation, formed SLAM estimation by acquiring acoustic signals.
the developed acoustic signal acquisition system of cus- The vehicle acquired the transmitted signal with a 96 kHz
tom modem was installed in the developed ASV. The sampling rate and performed EKF SLAM processes using
vehicle is also equipped with DVL and IMU for dead- the navigation sensors and acoustic signal data.
reckoning sensors. A typical modem was in the exper- Fig. 12 shows the experimental result of the acoustic-
imental environment with a mooring system. It period- based SLAM. In the figure, the blue dots and the blue
Development of an Autonomous Surface Vehicle and Performance Evaluation of Autonomous Navigation ... 543

Fig. 14. Given terrain map of the experimental environ-


ment (same area with Fig. 8).

Fig. 13. Estimation error of vehicle location of the


acoustic-based SLAM.

diamond represent the true locations of the vehicle and


acoustic source. The estimated vehicle location is shown
as red dots. It shows the accurate estimation of the vehi-
cle location. We used IMU data from the low-cost AHRS
sensor to show the effectiveness of the proposed acoustic
signal-based correction. Dead-reckoning using DVL and
IMU shows the accumulated and unbounded error of lo-
calization. On the other hand, the proposed acoustic-based
navigation provides accurate estimation and bounded er-
ror for both the vehicle and the acoustic source locations.
The red plus mark shows the estimated location of the
acoustic source. The estimated source location also shows
an accurate result.
Fig. 13 shows the vehicle location error of the proposed
acoustic-based SLAM by comparing the reference loca-
tions of GPS. The max error was less than 10 m while
the vehicle moved along the 1.3 km path. As shown in the
result, the proposed method provided accurate estimation Fig. 15. ASV tracking results. Dead-reckoning has drift
for both the vehicle and the acoustic source. It is achieved errors and conventional TBN fails in the flat area,
without any prior information of source location by EKF while the proposed TBN with Rz performs the
SLAM. best.

5.3. Performance tests of terrain-based navigation several times to provide a dense terrain map of the test
The proposed terrain-based localization method is im- area. The terrain map shown in Fig. 8 is a part of given
plemented with the ASV, and the performance was eval- map used in the experiment. Fig. 14 shows shape of the
uated. The developed ASV is used for data acquisition to given terrain map. For the localization test, the vehicle was
verify the proposed TBN method. The vehicle is equipped moved by waypoint tracking and the acquired sensor data
with Imagenex 837B MBES for sonar sensing, and Tele- of the navigation and sonar measurements. The waypoints
dyne RDI Explorer DVL and Advanced Navigation Spa- were provided as different locations with the path of pre-
tial FOG for dead-reckoning. GPS was only used for the survey for the thoroughness of the test.
waypoint tracking of the vehicle and reference path acqui- Fig. 15 shows the experimental results of the terrain-
sition to evaluate the accuracy of the localization. based localization. The tracking results of three meth-
The terrain map of the entire test area was obtained ods that are dead-reckoning, conventional PF-TBN, and
through a pre-surveying step to perform the proposed proposed PF-TBN are presented. The accumulated er-
terrain-based localization. The surveys were conducted ror in DVL-inertial navigation system(INS) based dead-
544 Jinwoo Choi, Jeonghong Park, Jongdae Jung, Yoongeon Lee, and Hyun-Taek Choi

Table 2. Tracking performance. vehicles with velocity constraints,” International Journal


of Control, Automation and Systems, vol. 10, no. 2, pp. 421-
ATE (m) DVL-INS TBN w/ Rz TBN w/o Rz 429, 2012.
Mean 9.74 3.25 3.77 [4] M. B. Loc, H.-S. Choi, J.-M. Seo, S.-H. Baek, and J.-Y.
Max 19.4 13.9 14.1 Kim, “Development and control of a new auv platform,”
International Journal of Control, Automation and Systems,
vol. 12, no. 4, pp. 886-894, 2014.
reckoning is substantially compensated by TBN when the
[5] L. Elkins, D. Sellers, and W. R. Monach, “The autonomous
underwater terrain provides rich information. When the
maritime navigation (amn) project: Field tests, autonomous
terrain is flat, conventional TBN (TBN without Rz ) shown and cooperative behaviors, data fusion, sensors, and vehi-
in the blue line resulted in a large error owing to the local cles,” Journal of Field Robotics, vol. 27, no. 6, pp. 790-818,
minima or particle impoverishment. In contrast, the ter- 2010.
rain adaptive PF (TBN with Rz ) shown in the magenta line [6] L. Zuo, W. Yan, R. Cui, and J. Gao, “A coverage algorithm
alleviates the problem. It could perform better localiza- for multiple autonomous surface vehicles in flowing envi-
tion because of the effective weight update and resampling ronments,” International Journal of Control, Automation
processes using the proposed terrain roughness. and Systems, vol. 14, no. 2, pp. 540-548, 2016.
Table 2 summarizes the absolute trajectory error (ATE) [7] M. Fu, T. Wang, and C. Wang, “Fixed-time trajectory track-
of the three methods. As shown, the proposed TBN ing control of a full state constrained marine surface ve-
method provided successful localization for underwater hicle with model uncertainties and external disturbances,”
navigation. International Journal of Control, Automation and Systems,
vol. 17, no. 6, pp. 1331-1345, 2019.
6. CONCLUSION [8] K. R. Reisenbichler, M. R. Chaffey, F. Cazenave, R. S.
McEwen, R. G. Henthorn, R. E. Sherlock, and B. H. Robi-
This paper addresses the development of an ASV and son, “Automating mbari’s midwater time-series video sur-
its performance evaluation. The ASV was developed as a veys: The transition from rov to auv,”Proc. of MTS/IEEE
catamaran type and it has enough payload to be equipped OCEANS 2016 - Monterey, pp. 1-9, 2016.
with various sensor systems. The guidance and control [9] C. Huet and F. Mastroddi, “Autonomy for underwa-
algorithms for the vehicle autonomy were implemented. ter robots–a european perspective,” Autonomous Robots,
Moreover, the vehicle was used as a testbed to validate vol. 40, no. 7, pp. 1113-1118, 2016.
two kinds of underwater navigation methods which are [10] A. Guerrero-González, F. García-Córdova, F. J. Ortiz,
acoustic-based SLAM and terrain-based localization. Ex- D. Alonso, and J. Gilabert, “A multirobot platform based
perimental results acquired by the actual experimental on autonomous surface and underwater vehicles with bio-
inspired neurocontrollers for long-term oil spills monitor-
data in an inland water environment demonstrated the
ing,” Autonomous Robots, vol. 40, no. 7, pp. 1321-1342,
performance of the vehicle and the proposed navigation
2016.
methods.
[11] K. Zwolak, B. Simpson, B. Anderson, E. Bazhenova,
As a short-term future direction, underwater navigation
R. Falconer, T. Kearns, H. Minami, J. Roperez, A. Rosedee,
algorithms addressed in this paper will be implemented
H. Sade, N. Tinmouth, R. Wigley, and Y. Zarayskaya, “An
and tested using an autonomous underwater vehicle. For unmanned seafloor mapping system: The concept of an auv
the surface vehicle itself, environmental recognition using integrated with the newly designed usv sea-kit,” Proc. of
various sensors such as optical camera, Lidar, and Radar MTS/IEEE OCEANS 2017 - Aberdeen, pp. 1-6, 2017.
will be developed for autonomous navigation on the sur- [12] K. Vickery, “Acoustic positioning systems. a practical
face of the water. As a long-term direction, the developed overview of current systems,” Proceedings of the 1998
navigation technologies might be fundamental technolo- Workshop on Autonomous Underwater Vehicles, pp. 5-17,
gies for the cooperative operation of surface and underwa- 1998.
ter vehicles. [13] A. Aloccer, P. Oliveira, and A. Pascoal, “Underwater
acoustic positioning systems based on buoys with gps,”
REFERENCES Proc. of 8th European Conference on Underwater Acous-
tics, pp. 1-5, 2006.
[1] J. Yuh, Underwater Robotic Vehicles: Design and Control, [14] P. Newman and J. Leonard, “Pure range-only sub-sea
TSI Press, Albuquerque, NM, 1995. slam,” Proc. of IEEE International Conference on Robotics
[2] L. Whitcomb, D. R. Yoerger, H. Singh, and J. Howland, and Automation, vol. 2, pp. 1921-1926, 2003.
“Advances in underwater robot vehicles for deep ocean [15] N. R. Rypkema, E. M. Fischell, and H. Schmidt, “One-
exploration: Navigation, control, and survey operations,” way travel-time inverted ultra-short baseline localization
Robotics Research, pp. 439-448, 2000. for low-cost autonomous underwater vehicles,” Proc. of
[3] Z. Li, C. Yang, N. Ding, S. Bogdan, and T. Ge, “Robust IEEE International Conference on Robotics and Automa-
adaptive motion control for underwater remotely operated tion, pp. 4920-4926, 2017.
Development of an Autonomous Surface Vehicle and Performance Evaluation of Autonomous Navigation ... 545

[16] S. Thrun, W. Burgard, and D. Fox, Probabilistic Robotics, Jeonghong Park received his B.S. and
MIT press, 2005. M.S. degrees in mechatronics engineering
[17] J. P. Golden, “Terrain contour matching (TERCOM): a from Chungnam National University, Dae-
cruise missile guidance aid,” SPIE, vol. 238, pp. 10-18, jeon, South Korea, in 2005 and 2007, re-
1980. spectively, and a Ph.D. degree in mechan-
ical engineering from the Korea Advanced
[18] D. Meduna, Terrain Relative Navigation for Sensor-limited Institute of Science and Technology, Dae-
Systems with Application to Underwater Vehicles, Ph.D. jeon, in 2016. He is currently a Senior Re-
thesis, Stanford University, 2011. searcher with the Korea Research Institute
[19] J. Melo and A. Matos, “Survey on advances on terrain of Ships and Ocean Engineering, Daejeon. He has been involved
based navigation for autonomous underwater vehicles,” in the areas of ocean robotics, vision-based perception and track-
Ocean Engineering, vol. 139, pp. 250-264, 2017. ing, and path planning of autonomous ships and marine robots.
[20] T. Kim, J. Kim, and S.-W. Byun, “A comparison of nonlin-
ear filter algorithms for terrain-referenced underwater nav- Jongdae Jung received his B.S. degree in
igation,” International Journal of Control, Automation and civil engineering from the Hanyang Uni-
Systems, vol. 16, no. 6, pp. 2977-2989, 2018. versity, Seoul, Korea, in 2008, and his
[21] J. Park, J. Choi, and H.-T. Choi, “Collision risk evalua- M.S. and Ph.D. degrees in civil and en-
tion and collision-free path planning of autonomous sur- vironmental engineering from the Korea
face vehicles considering the uncertainty of trajectory pre- Advanced Institute of Science and Tech-
diction,” Journal of Institute of Control, Robotics and Sys- nology (KAIST), Daejeon, Korea, in 2010
tems, vol. 24, no. 7, pp. 608-616, 2018. and 2015, respectively. He is currently
a Senior Researcher with the Korea Re-
[22] J. Park and J. Kim, “Predictive evaluation of ship collision search Institute of Ships and Ocean Engineering (KRISO),
risk using the concept of probability flow,” IEEE Journal Daejeon, Korea. His current research interests include marine
of Oceanic Engineering, vol. 42, no. 4, pp. 836-845, 2017. robotics, underwater perception and navigation, and simultane-
[23] C. Yong and E. J. Barth, “Real-time dynamic path planning ous localization and mapping.
for dubins’ nonholonomic robot,” Proceedings of the 45th
IEEE Conference on Decision and Control, pp. 2418-2423,
Yoongeon Lee received his B.S. degree
2006.
in Division of Robotics from Kwangwoon
[24] M. Chitre, I. Topor, and T. Koay, “The unet-2 modem — an University, Seoul, Korea, in 2015 and an
extensible tool for underwater networking research,” Proc. M.S. degree in Mechanical Engineering
of MTS/IEEE OCEANS 2012 - Yeosu, pp. 1-7, 2012. from Sungkyunkwan University, Suwon,
[25] C. Knapp and G. Carter, “The generalized correlation Korea, in 2017. He is currently a Project
method for estimation of time delay,” IEEE Transactions Based Research Scientist with the Korea
on Acoustics, Speech, and Signal Processing, vol. 24, no. 4, Research Institute of Ships and Ocean En-
pp. 320-327, 1976. gineering, Daejeon. He has been involved
in the control and design of marine robots.
[26] J. Choi, J. Park, Y. Lee, J. Jung, and H.-T. Choi, “Robust
directional angle estimation of underwater acoustic sources
using a marine vehicle,” Sensors, vol. 18, no. 9, 2018. Hyun-Taek Choi received his B.S., M.S.,
and Ph.D. degrees in electronic engineer-
[27] J. Fernandez-Madrigal and J. Claraco, Simultaneous Local-
ing from Hanyang University, Seoul, Ko-
ization and Mapping for Mobile Robots, Information Sci-
rea, in 1991, 1993, and 2000, respectively.
ence Reference, 2013.
He was an Associate Research Engineer
[28] E. Olson and P. Agarwal, “Inference on networks of mix- with Korea Telecom from 1993 to 1995.
tures for robust robot mapping,” The International Journal He was with the University of Hawaii,
of Robotics Research, vol. 32, no. 7, pp. 826-840, 2013. as a Post-Doctoral Researcher, from 2000
to 2003. He is currently a Principal Re-
searcher with the Korea Research Institute of Ships and Ocean
Jinwoo Choi received his B.S., M.S., and Engineering, Daejeon, Korea. He has been leading several
Ph.D. degrees in mechanical engineering projects related to underwater robotic applications, such as the
from the Pohang University of Science design of ROVs and AUVs, advanced control and navigation,
and Technology, Korea, in 2003, 2005, and recognition using optic camera and sonar, and robot intelligence.
2011, respectively. He is currently a Senior
Researcher with the Korea Research Insti- Publisher’s Note Springer Nature remains neutral with regard
tute of Ships and Ocean Engineering, Dae- to jurisdictional claims in published maps and institutional affil-
jeon, Korea. His current research interests iations.
are mainly concentrated on mapping, lo-
calization, SLAM, and acoustic source localization for marine
robots.

You might also like