Abstract

This paper presents a novel navigation strategy of robot to achieve reaching target and obstacle avoidance in unknown dynamic environment. Considering possible generation of uncertainty, disturbances brought to system are separated into two parts, i.e., bounded part and unbounded part. A dual-layer closed-loop control system is then designed to deal with two kinds of disturbances, respectively. In order to realize global optimization of navigation, recurrent fuzzy neural network is used to predict optimal motion of robot for its ability of processing nonlinearity and learning. Extended Kalman filter method is used to train RFNN online. Moving horizon technique is used for RFNN motion planner to guarantee optimization in dynamic environment. Then, model predictive control is designed against bounded disturbances to drive robot to track predicted trajectories and limit robot’s position in a tube with good robustness. A novel iterative online learning method is also proposed to estimate intrinsic error of system using online data that makes system adaptive. Feasibility and stability of proposed method are analyzed. By examining our navigation method on mobile robot, effectiveness is proved in both simulation and hardware experiments. Robustness and optimization of proposed navigation method can be guaranteed in dynamic environment.

1. Introduction

During past decades, navigation which can fully reflect artificial intelligence and automatic ability of robot has been an attractive topic [1]. Autonomous navigation is realized in kinds of robots like ground mobile vehicles, unmanned underwater vehicle (UUV), unmanned aircraft, etc. [25]. These robots with navigation technology have been applied popularly in various fields such as industry, public service places, transportation, and military [6]. Generally, navigation structure is made up of three main components, perception, decision, and control. Different sensors, such as lidar, inertial measurement unit, GPS, and visual camera, have been used for this purpose generating a series of solutions. This is beyond this paper’s scope. The main problems that this paper prefers to solve are decision and control under assumption of known perception capability.

Navigation of robot in objective world is complex for the reasons of existing various uncertainty and nonlinearity of system [7, 8]. Disturbance or perturbation caused by uncertainty brings challenge to design navigation system. Many inevitable factors lead to uncertainty like dynamic circumstances, sensor noises, and model error [9]. They are coupled and impact together on system. In order to achieve real-time navigation and guarantee safety of robot taking obstacles into account, nonlinear optimal program of robot motion needs to be carried out [10]. However, to make system stable and robust under this condition, control strategy can be tedious and time-consuming. So, effective method should be designed to deal with optimal robust problem of the nonlinear system.

Fuzzy logic control is well suited to control robot for its accurate calculation capability and inference capability under uncertainty [11]. Many researchers have implemented this method to deal with navigation of robot. Wang [12] proposed a real-time fuzzy logic control in unknown environment to achieve obstacle avoidance. However, fuzzy logic based method is too sample to deal with complex problem and the structure is less of flexibility. Neural network based approaches have been widely employed in closed-loop control for their strong nonlinear approximation and self-learning capability [13]. Many researches have been done on feedforward multilayer perception neural network for classification, recognition, and function approximation. In [14], recurrent neural network is used to solve optimal navigation problem of multirobot. By constructing formation and using penalty method, navigation becomes convex optimization problem. Recently, fuzzy logic and recurrent neural network structure are combined to form a new structure, i.e., recurrent fuzzy neural network (RFNN). RFNN combines both advantages of neural network and fuzzy logic and earns good nonlinear control capability [15]. In [16], interval type 2 fuzzy neural network is used to control robot. By tuning parameters of structure with genetic algorithm, stable navigation is realized. However, optimization of navigation is not guaranteed and disturbances are not considered in their method.

Model predictive control (MPC) has been successfully applied to process industries during past decades for its online optimization programming ability [17]. At each time-step, MPC obtains a finite sequence of control by solving a constrained, discrete-time, optimal control problem over prediction horizon. Current control variable of the sequence is regarded as control law to be applied to the system. By solving the optimal control problem within one sampling interval, MPC can effectively manage MIMO system and hard constraint system. Robust nonlinear MPC (RNMPC) is an active area of research and can easily handle constraint satisfaction against dynamic uncertainty [18]. If a controlled system is ISS with respect to bounded uncertainties, it has a stability margin and is therefore stable with respect to unmodeled dynamics [19]. Many researches have been published using MPC method realizing optimal navigation [20]. In [21], a dual-layer architecture is proposed using MPC and maximum likelihood estimation method to deal with navigation in uncertainty environment. In contrast to our method, it is a kind of probabilistic framework based method. In [22], MPC is also developed to micro air vehicle system generating real-time optimal trajectory in unknown and low-sunlight environments. In [23], autopilot controlling the nonlinear yaw dynamics of an unmanned surface vehicle is designed using MPC combined with multilayer neural network.

Inspired by methods mentioned above, a dual-layer control system is designed in this paper. Considering nonlinear nonconvex property of navigation in dynamic environment, RFNN based planner is used to program optimal trajectory of robot. Many methods can be used to train RFNN like backpropagation (BP), genetic algorithm, evolutionary strategy, and particle swarm optimization [24]. Extended Kalman filter (EKF) has attracted many researchers for its characteristics of fast convergence, little limitation in training data, and good accuracy in mathematics process [25]. So, in this paper EKF is used to train RFNN to achieve optimal navigation. A kind of nonlinear robust MPC is then designed to generate actual control command of robot to drive robot to track predictions. Considering that there exists intrinsic error between known model and actual model of navigation system of robot, online estimation method needs to be designed. Learning based controller is more adaptive in practical application [26]. By using online data, accurate approximation of the true system model can be constructed. These learning methods mainly consist of Gaussian process and iterative learning methods [27]. In this paper, a specific application based iterative learning method is designed to update system model.

The rest of the paper is structured as follows. Section 2 introduces description of problem settled in this paper. Section 3 describes the working of proposed navigation strategy. Section 4 proves stability and feasibility of proposed method. Section 5 illustrates experiments and results and finally Section 6 concludes the proposed scheme.

2. Problem Description

In this paper, navigation of robot is realized in unknown environment and the system is nonlinear with constraints. Robust and optimal navigation should be achieved considering dynamic environment and disturbances.

Consider the following discrete nonlinear model of robot system:where is control input and are system states at time and , respectively. is measured output at time and are process and measurement disturbances, respectively. and are nonlinear functions where is model of system and is model of observation. Realistic physical plants are strictly proper, so output function can be simplified as .

In (1), is model error caused disturbance while mainly contains sensor noise and dynamic environment caused disturbance. Among these uncertainties, dynamic environment changes in random leading to unboundedness of disturbance. On the other hand, model error and sensor noise are bounded and normally are Gaussian that can be estimated. To design useful control method decomposition and combination are used for disturbances asFeedback controller is usually designed using to generate control input , so (1) changes aswhere . represents controller. Then, disturbances are separated into two parts, bounded disturbance represented as and unbounded disturbance represented as .

To achieve navigation, suitable controller should be designed. Considering disturbances divided into two items, we separate strategy into two phases. Real-time program of optimal trajectory is designed at first and robust control of robot is then designed to track the optimal trajectory. In program phase, recurrent fuzzy neural network with moving horizon is designed to plan optimal motion to get robust performance considering and can be illustrated as . After is limited, robust model predictive control method is designed in tracking period to deal with and can be illustrated as . is decoupled from , so is not considered during tracking. Then, a controller with dual-layer structure is formed to deal with two kinds of disturbances, respectively. Structure is shown in Figure 1. By separating controller into two parts, bounded and unbounded disturbances are suitably dealt with so that optimal robust performance is realized. Further introduction of control system is in next section.

3. Control System Design

To realize robust optimal navigation of robot, rational framework of control system is designed in this section. Robust nonlinear model predictive controller and recurrent fuzzy neural network based planner are combined to make up the whole control system. Flow diagram is shown in Figure 3 which is extension of Figure 2. Figure 3 emphasizes each part’s function in navigation strategy and is consistent with Figure 2 which mainly explains relationship of uncertainty, controller, and nominal system.

The system is made up of nonlinear planner, robust tracker, and local plant. As mentioned in Section 2, there exist kinds of uncertainty bringing disturbances to robot. In order to improve the performance of robot avoiding obstacles and reaching the target, feedback loops that can be used to construct constraints of system are added. Extended Kalman filter is used to train RFNN online to program optimal motion of plant. Iterative online leaning method is used to make system adaptive to disturbance improving performance of MPC.

3.1. RFNN Based Nonlinear Program

Objective function and constraints should be set to realize motion program of navigation. Considering (3), nominal state-space function of robot is represented aswhere discussed later keeps invariant in this department and is represented as . Objective function reflecting shortest distance can be used:where is distance operator.

RFNN structure used here contains five layers and is shown in Figure 3. In order to achieve obstacle avoidance and reach target, output of system is chosen as input of RFNN, i.e., , while is generated control command to local plant. Subscript is omitted here for simplification. Each node in membership layer performs a membership function. Membership functions can be defined with Gaussian MF aswhere is exponential function. , are the mean and standard deviation of Gaussian function, respectively. The values of them are initially set via expert experience before the strategy begins.

As shown in Figure 3, each input parameter has two membership values, so there are fuzzy rules in fuzzy rule layer. The firing strength of each rule at current step is determined by outputs of membership layer through an AND operator. The result of each rule is calculated asMoreover, a local internal feedback with real-time delay is added to each node of this layer to improve the robustness of the control system. The mathematical form is described bywhere represents the weight of self-feedback loop and is a constant; is current output of this layer while represents the last step output.

Then, according to the definition of Takagi-Sugeno-Kang (TSK) fuzzy rules, the functions are combined linearly in consequent layer. TSK weight is defined aswhere , . For the purpose of simplifying calculation, it is assumed that . The output of this layer can be computed as follows:Activation function is set at each node of output layer to limit output forming output constraint:where is constant and its value depends on practical application.

In order to achieve motion program, extended Kalman filter method proposed in [28] is modified to train the weights of RFNN structure online. At step k, the EKF function is expressed as follows:where is Kalman gain matrix. is estimation error. is desired value of which is observation vector. is covariance matrix of measurement error. is constant matrix and is set according to [28], is covariance matrix of estimation error, and is identity matrix. is orderly derivative matrix of observation vector with respect to RFNN weights.

Constraints of obstacles and target during navigation process are achieved by establishing observation vector in (13); Jacobian matrix is then calculated to predict weights of RFNN:Target constraint is always prior. Only when obstacles threaten safety of robot, is obstacle constraint considered in (13). As initial weights are generated in random, by repeating calculation suboptimal trajectory can be got satisfying (4). Calculation time is depending on repetition. To deal with uncertainty caused by dynamic environment, moving horizon is used forming online dynamic program. are trajectories generated in different horizon. is time between contiguous horizons. Time constraint should be satisfied:where depends on uncertainty. A new variable is set to judge disturbance using quadratic form aswhere and are observation vectors at each step of program trajectory under system (4) and real trajectory under system (3), respectively. is matrix of weights. Upper bound is set to getAccording to (4)~(19), global motion program is obtained with bounded . However, during practical process there exists affecting performance of navigation. So, suitable control and online learning method are needed in tracking procedure to guarantee robustness of system and ensure effective estimation of disturbances.

3.2. Learning Based Robust Tracking
3.2.1. Robust Nonlinear Model Predictive Control

Tube-based robust nonlinear model predictive control makes closed-loop trajectory, in the presence of disturbances, lie in a tube whose center is nominal trajectory. In this paper, nominal trajectory is generated by RFNN motion planner and then a tube-based approach is adopted to tracking system considering uncertainty caused by model and location error.

Considering (3) and (4), robot system to be controlled is the following nonlinear state-space form with bounded disturbances and is not included:where is twice continuously differentiable.

If cost function of MPC is Lipschitz continuous; there exist two invariant sublevel sets of such that the smaller set is robustly asymptotically stable for controlled system with a region for attracting the larger set [29]. Planned state and control input of navigation system in Section 3.1 are chosen as nominal state and control represented as , respectively. The controller aims at steering robot with disturbances close to index prediction and keeping actual trajectory of robot in a tube with good robustness. However, nominal state and control provided above are finite and the whole trajectory keeps changing as introduced in (17) ~ (19). To obtain effective and tightened reference sets, the following procedure is used. An object is defined asrepresenting trajectories and update interval in different horizon. Only the first step of is valid motion. And interpolation is applied to get tightened and .

Considering deviation of state and control between actual system and nominal system, cost function to be minimized is defined aswhere and are positive definite. and are reference trajectory and control action, respectively. is terminal cost function and is terminal state that is changing due to (21).

Optimal control problem can be illustrated asThe solution of (23) is and associated state trajectory is . is applied to uncertainty system, i.e., the first element in the sequence. If , then , so that . Minimum value of cost function at each step of trajectory is represented as . Level set of cost function defines a neighborhood of nominal trajectory. A tube can be defined [29]:According to [30], stable condition exists:where and . is positive definite. Then is determined as . Method in [31] is used to solve the optimization problem.

3.2.2. Iterative Online Learning

In actual situation there are disturbances caused by inaccurate model established a priori and invariant perception error. So, online learning method should be considered to estimate intrinsic part of disturbances online and make the control system effective. As is nonlinear in (20), disturbance is no more Gaussian leading to the fact that GP based estimation method is not suitable here. So, a kind of PD iterative online learning method is designed in this section to estimate disturbances. The process is assumed to occur in an unknown environment and robot moves to goal avoiding obstacles in a predictive routine instead of a known iterative path. So, compared to traditional iterative method dynamic iterative route is used in our iterative learning algorithm. In order to learn compensation with dynamic route, suitable and effective iterative function should be designed as follows.

Kinematic model of mobile robot is used here to introduce the procedure and detailed information is introduced in Section 5.1. Then state-space system in (20) can be illustrated aswhere is state of system, is control input, and is disturbance need to be learned.

Each iteration has equations, but start and end points are different. The demonstration of choosing iteration route is illustrated intuitively in Figure 4. There are two trials end at points 1 and 2, respectively, during the process; start points can be got due to same steps .

In order to use this form of iterative route, a new variable is defined: . According to (26), equations can be got:where , , and are variables of references produced by RFNN in Section 3.1. In order to simplify representation, is replaced by above. Then the lifted form can be organized aswhere represents iteration and is lower triangular matrix. Component of each item is shown asAlthough the system illustrated by (26) is nonlinear, it is Lipschitz continuous. According to [32], linear method can deal with this kind of problem well. Compared to nominal discrete-time system introduced in [33], the initial conditions in (28) are different at each iteration. Many methods can be used to settle this problem such as initial state learning mechanism or smooth interpolation. As shown above, is made up of discrepancy at all steps in each trajectory. Suppose the first two iterations are convergent, then decreases in later iteration and is upper bounded. So, a simple forgetting factor is used to discount integration effect of iterative learning. Then a kind of PD-type iterative learner is used:where and are proportional and derivative learning gains, respectively. is lower triangular Toeplitz matrix derived from column vector where 0 is matrix with 0 elements and is unit matrix.

For iteration , error can be defined aswhere represents desired error between actual state and optimal predictive state and it is usually 0. Substituting (31) and (28) into (30) yields closed-loop iteration dynamics:According to [33], iterative learning process is asymptotically stable, ifwhere is spectral radius operator.

4. Stability Analysis

According to Figure 2, the control system is made up of two parts. So, in order to analyze stability of the system, each part’s stability should be guaranteed.

4.1. Convergence of Recurrent Fuzzy Neural Network

In this paper, a training method based on EKF is used as shown in Section 3.1. Appropriate parameters should be designed. Then, by iteratively calculating (12) ~ (15) trajectories are generated. By evaluating these trajectories, suboptimal trajectory is chosen.

Observation vector, , is first expanded at final stable weights aswhere is first-order approximation residue and is mapping function from weights to observation. Error of weights can be defined: .

Then, Lyapunov function can be chosen asThe difference can be calculated aswhere . Then following inequation can be got according to [28]where is the trace of , . is identity matrix and is a positive real number. For details of inference formula refer to [28].

As mentioned above, and determine convergence of EKF training process. is derived from observation vector . In order to guarantee effectiveness of recurrent fuzzy neural network structure, should be constructed reasonable. According to (6) ~ (16),where illustrates plant information, illustrates RFNN structure information, and illustrates relation between observation and plant’s state. Jacobian matrix, , reflects performance of chosen weights to system. Then is designed considering to realize convergence of strategy.

In (37), system is convergent if and then should be set aswhere each element of is normal distribution as ; thenwith 99.99%   being bounded.

And adaption law is got:which can make control system’s error convergent, i.e., bounded .

As mentioned in Section 3.1, initial weights are generated in random leading to predictive trajectories being different with different initial weights. Initial weights are represented aswhere each element corresponds to an independent trajectory produced by EKF training method. Some method can be chosen to learn initial weights, but a simple method of iteration is used to economize computation cost and guarantee real-time program ability. Considering practical condition, evaluation of optimal trajectory is different especially in dynamic navigation problem. With evaluation criteria, is chosen to obtain suboptimal trajectory.

4.2. Stability and Robustness of Nonlinear Model Predictive Control

By using RFNN based planner, a set of trajectories are obtained in (21) to approximate optimal path in dynamic environment. MPC method is then used to limit states of robot in a tube around the optimal path under disturbance .

For each trajectory in , suppose there is and bounded area around trajectory is . Let denotes generated state of nominal system; i.e., , with input . Since () is Lipschitz continuous, for all . According to (22) and (25), there exists such thatStability condition is established in (25); thenThere is also lower bound due to weight matrix , soCombine (43) ~ (45), andIn practice, the surroundings where robot needs to achieve navigation can be entirely or partially detected by sensors. Suppose the change of surroundings is continuous and not too fast relative to robot’s motion. Then disturbance is bounded. Let . According to [29], for all and , there is a constant such thatIf , (47) becomesSo, there exists constant that limits actual path of robot in a tube of optimal trajectory generated by RFNN.

After analysis and design of the overall system, whole strategy of navigation is illustrated as Algorithm 1.

Initialization: , obtain initial position of target and obstacles, .
set
while    do
Prediction: Predict robot motion according to (4) ~ (16) and (33) ~ (39).
Generate trajectory in as well as referential states and control commands, i.e. .
while    do
Tracking: Generate actual control command, , according to (21) ~ (30).
Sensor: Measure distance and angel information among target, obstacles and robot, i.e. .
Location: Estimate state of robot, obstacle and target, i.e. .
Update .

5. Experiments

5.1. Model of Mobile Robot

In order to approve effectiveness of our control system, a kind of differentially driven mobile robot system model in [9] is used here. The robot model in unknown environment with obstacles and target is illustrated as in Figure 5.

Robot is motivated by right and left wheels, . Linear and angular velocities areDifference equation is then illustrated aswhere . are robot’s postures at and steps, respectively, and are represented as .

Distance and angle of target and nearest obstacle corresponding to robot are chosen as measurement, so output is represented asAs shown in Figure 5, a sparse representation of obstacles is used to train RFNN. Circles with center on obstacle represent dangerous area. Radius of circle depends on EKF learning method and estimation error. Location of obstacle is usually not accurate leading to error of centers’ position shown in figure. Distance between and depends on . Although RFNN structure is convergent, robot will vibrate at terminal position due to feedback control principle. When robot reaches area determined by , a brake control is used.

5.2. Performance in Static Condition with Bounded Disturbance

Simulation experiment is carried out using Matlab. Activity space is limited in . There exist obstacles and target. Mobile robot needs to reach target and avoid obstacles. Constant parameters to be initialized are listed in Table 1. The weight matrices are set with 25 : 15 : 1 ratio weighting position-tracking error and linear and angular velocity control input in (22). The weight is switched between two sets due to position corresponding to target and obstacles.

Proposed method is first examined in static environment. As environment is static, only one prediction of optimal motion of robot is generated and the weights of RFNN are shown in Figure 6. There is no drastic variety underlying smoothness of process. Gaussian noise with mean zero and variance of 0.03 is injected to system named as disturbance 1. And 20 trajectories are generated under random disturbance. Performance is shown as in Figure 7. All trajectories are bounded in a band. Each trajectory of robot can realize reaching adjacent area of target and avoiding obstacles. Optimal and robust navigation is achieved. Position error curves of robot are shown in Figure 8(a), which are bounded in a narrow band. Figures 8(b) and 8(c) represent linear and angular velocities of robot, respectively. They are not narrow contrasted to position error for the reason that input commands should control robot against random disturbance and limit robot’s position in a narrow tube. Computation cost of generating optimal control command at each step is shown in Figure 9. Lines in red are average values.

5.3. Performance of Online Iterative Learning Method

In order to examine online iterative learning method proposed, Gaussian noise with mean 0.1 and variance of 0.03 is injected to system named as disturbance 2. 20 trajectories are also generated under this random disturbance. Performance is shown as Figure 10. For neat expression only one trajectory without iterative learning in magenta is shown in figure. This trajectory is dangerous and does not lie in stable tube. Trajectories with iterative leaning are illustrated in cyan and are same as trajectories under disturbance 1 underlying estimation method which is effect. Estimation of disturbance 2 is shown in Figure 11. Detailed information is shown in Table 2. There is not much difference of values in each item between two conditions. The largest bias at each point of 20 trajectories under two conditions is shown in Figure 12. The largest bias of trajectories under disturbance 2 is a little higher.

5.4. Comparison with Other Methods

The main novelty of proposed method in this paper is that a motion planning and control method based navigation strategy is proposed to deal with uncertainty and guarantee robust optimization of the process. The dual-layer structure is designed to be feasible and effective by combining RFNN and MPC method. Many motion planning techniques are used to achieve navigation, like potential field method, sampling based planner, interpolation curve method, A, neural network, fuzzy logic, genetic algorithm, particle swarm optimization, etc. A method is widely used in autonomous vehicles for its efficiency [34]. Furthermore, OPTI toolbox of Matlab includes many optimal solvers that can be used to design nonlinear planner. In order to introduce our method’s effectiveness, A method together with OPTI based numerical optimization method is compared with ours. As control policy is considered in our method, PID method in [35] is used for two planners above forming complete navigation system just like ours. Performance is shown in Figure 13. A method just plans positions of robot, leading to bad tracking performance under disturbance which is reflected by tracking error in Table 3 and the path in red with rectangle marks. The trajectory is not smooth contrasted to our method and OPTI and PID method. PID control method that lacks online learning mechanism fails to drive robot to target when disturbance in Figure 10 acted on system, which is reflected by red path with triangle marks. Compared to A  and PID based strategy, OPTI and PID method that plans motion performs better. But OPTI based planner takes up too much computation cost reflected in Table 3 leading to bad real-time planning ability. Detailed information of these methods’ performance is illustrated in Table 3. It is proved that our method can achieve good online navigation.

5.5. Performance in Dynamic Condition

Proposed method is then examined in dynamic environment. Performance is shown in Figure 14. Dynamic obstacles referred to in Figure 7 keep moving during process. Trajectories of obstacles are shown in Figures 14(a)14(d). Target also keeps moving during the whole process. RFNN needs to update predictions depending on changes of surroundings limited by threshold settled above. And measured varying with time is shown in Figure 15. Each state in Figures 14(a)14(f) is corresponding to zero point of in Figure 15. Six predictions are generated during the whole process. As seen in Table 4, the first four predictions are generated due to (17) ~ (19) and last two are generated due to runout of steps. Changes of RFNN weights are shown in Figure 16. Detailed information of different phases is shown in Table 4. Position error between robot and target is shown in Figure 17(a). Linear and angular velocity of robot is shown in Figures 17(b) and 17(c). As shown above, optimal and robust navigation is achieved in dynamic environment.

5.6. Hardware Experiments on a Vehicle

In this section, we will validate navigation strategy presented in this paper on a differential driven vehicle. The onboard processor of vehicle is STM322F407 that is responsible for real-time control. All the online computation, including localization, motion planning, and optimal control command generation, is performed on a computer with Intel i5 2.3 GHz processor and 8 GB RAM. Commands are sent through a 2.4 GHz Bluetooth transmitter at an update rate of 50 Hz.

The experiment is carried out in indoor environment as shown in Figure 18. There are two moving tracked mobile robots between our robot and target. The robot needs to reach target and avoid collision with them. The software running on the computer is developed based on the ROS middleware. 2D map of surroundings is established using LIDAR carried on the front of robot. Adaptive Monte Carlo localization method is used to localize robot’s position. RFNN based motion planner is used for global optimization programming. NMPC based controller is used for robust optimal control. The performance is shown in Figure 19. The trajectories in red are optimal predictions of robot’s motion. Optimal prediction is updated due to moving obstacle. Figure 20 illustrates changes of which is tanglesome contrasted to Figure 15. Trajectory in blue is actual motion of robot. Motion state is reflected in Figure 21. Computation cost and changes of weights are, respectively, shown in Figures 22 and 23. Comparison between hardware and simulation experiment in Section 5.5 is shown in Table 5. As prediction cost depends on distance between vehicle and target, simulation experiment takes up more computation than hardware experiment and prediction time is more. Average computation cost of both experiments at each step is about half a second. Average tracking error of hardware experiment is higher than simulation for the reasons of effective location method in actual situation. According to hardware experiment, our method’s effectiveness is proved.

6. Conclusion

In this paper, a combined nonlinear model predictive control and recurrent fuzzy neural network approach is designed to achieve robust and optimal navigation in unknown and dynamic environment. Controller is separated into two parts depending on disturbances of system forming dual-layer structure. RFNN based dynamic program is used to predict optimal trajectory in unknown environment. NMPC is used to track optimal trajectories against location and model error. By applying our method to wheeled mobile robot, simulation experiment is carried out. According to analysis of experiment results, robustness and optimization of designed strategy are proved. Although proposed method is used in ground robot system, it is also applicable to UUV, UAV, space aircraft, etc. Because problem described in Section 2 and working in Section 3 are not specific to a certain model, in our future work, perception ability mentioned in Section 1 will be considered in practical navigation system.

Data Availability

The data used to support the findings of this study are available from the corresponding author upon request.

Conflicts of Interest

The authors declare that there are no conflicts of interest regarding the publication of this paper.

Acknowledgments

This work is supported by the National Natural Science Foundation of China under Grant 61673129, the Natural Science Foundation of Heilongjiang Province of China under Grant F201414, and the Fundamental Research Funds for the Central Universities under Grant HEUCF160418.

Supplementary Materials

There is a video in the supplementary material file. It is simulation experiment result that describes robot’s motion in dynamic environment and reflects effectiveness of the navigation method. The video corresponds to Figures 14(a)14(d) in the manuscript. It is uploaded to show the whole process intuitively for editors. (Supplementary Materials)