期刊文献+
共找到138篇文章
< 1 2 7 >
每页显示 20 50 100
Adaptive Trajectory Tracking Control for Nonholonomic Wheeled Mobile Robots:A Barrier Function Sliding Mode Approach
1
作者 Yunjun Zheng Jinchuan Zheng +3 位作者 Ke Shao Han Zhao Hao Xie Hai Wang 《IEEE/CAA Journal of Automatica Sinica》 SCIE EI CSCD 2024年第4期1007-1021,共15页
The trajectory tracking control performance of nonholonomic wheeled mobile robots(NWMRs)is subject to nonholonomic constraints,system uncertainties,and external disturbances.This paper proposes a barrier function-base... The trajectory tracking control performance of nonholonomic wheeled mobile robots(NWMRs)is subject to nonholonomic constraints,system uncertainties,and external disturbances.This paper proposes a barrier function-based adaptive sliding mode control(BFASMC)method to provide high-precision,fast-response performance and robustness for NWMRs.Compared with the conventional adaptive sliding mode control,the proposed control strategy can guarantee that the sliding mode variables converge to a predefined neighborhood of origin with a predefined reaching time independent of the prior knowledge of the uncertainties and disturbances bounds.Another advantage of the proposed algorithm is that the control gains can be adaptively adjusted to follow the disturbances amplitudes thanks to the barrier function.The benefit is that the overestimation of control gain can be eliminated,resulting in chattering reduction.Moreover,a modified barrier function-like control gain is employed to prevent the input saturation problem due to the physical limit of the actuator.The stability analysis and comparative experiments demonstrate that the proposed BFASMC can ensure the prespecified convergence performance of the NWMR system output variables and strong robustness against uncertainties/disturbances. 展开更多
关键词 Adaptive sliding mode barrier function nonholonomic wheeled mobile robot(NWMR) trajectory tracking control
下载PDF
Inverted Modelling:An Effective Way to Support Motion Planning of Legged Mobile Robots
2
作者 Chenyao Zhao Weizhong Guo 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2023年第1期268-279,共12页
This paper presents an effective way to support motion planning of legged mobile robots—Inverted Modelling,based on the equivalent metamorphic mechanism concept.The difference from the previous research is that we he... This paper presents an effective way to support motion planning of legged mobile robots—Inverted Modelling,based on the equivalent metamorphic mechanism concept.The difference from the previous research is that we herein invert the equivalent parallel mechanism.Assuming the leg mechanisms are hybrid links,the body of robot being considered as fixed platform,and ground as moving platform.The motion performance is transformed and measured in the body frame.Terrain and joint limits are used as input parameters to the model,resulting in the representation which is independent of terrains and particular poses in Inverted Modelling.Hence,it can universally be applied to any kind of legged robots as global motion performance framework.Several performance measurements using Inverted Modelling are presented and used in motion performance evaluation.According to the requirements of actual work like motion continuity and stability,motion planning of legged robot can be achieved using different measurements on different terrains.Two cases studies present the simulations of quadruped and hexapod robots walking on rugged roads.The results verify the correctness and effectiveness of the proposed method. 展开更多
关键词 Gait planning Inverted Modelling Legged mobile robot Motion planning WORKSPACE
下载PDF
Glass Recognition and Map Optimization Method for Mobile Robot Based on Boundary Guidance
3
作者 Yong Tao He Gao +2 位作者 Yufang Wen Lian Duan Jiangbo Lan 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2023年第3期135-146,共12页
Current research on autonomous mobile robots focuses primarily on perceptual accuracy and autonomous performance.In commercial and domestic constructions,concrete,wood,and glass are typically used.Laser and visual map... Current research on autonomous mobile robots focuses primarily on perceptual accuracy and autonomous performance.In commercial and domestic constructions,concrete,wood,and glass are typically used.Laser and visual mapping or planning algorithms are highly accurate in mapping wood panels and concrete walls.However,indoor and outdoor glass curtain walls may fail to perceive these transparent materials.In this study,a novel indoor glass recognition and map optimization method based on boundary guidance is proposed.First,the status of glass recognition techniques is analyzed comprehensively.Next,a glass image segmentation network based on boundary data guidance and the optimization of a planning map based on depth repair are proposed.Finally,map optimization and path-planning tests are conducted and compared using different algorithms.The results confirm the favorable adaptability of the proposed method to indoor transparent plates and glass curtain walls.Using the proposed method,the recognition accuracy of a public test set increases to 94.1%.After adding the planning map,incorrect coverage redundancies for two test scenes reduce by 59.84%and 55.7%.Herein,a glass recognition and map optimization method is proposed that offers sufficient capacity in perceiving indoor glass materials and recognizing indoor no-entry regions. 展开更多
关键词 Autonomous mobile robot Multi-sensor fusion Glass recognition Map optimization
下载PDF
A review of mobile robot motion planning methods:from classical motion planning workflows to reinforcement learning-based architectures
4
作者 DONG Lu HE Zichen +1 位作者 SONG Chunwei SUN Changyin 《Journal of Systems Engineering and Electronics》 SCIE EI CSCD 2023年第2期439-459,共21页
Motion planning is critical to realize the autonomous operation of mobile robots.As the complexity and randomness of robot application scenarios increase,the planning capability of the classical hierarchical motion pl... Motion planning is critical to realize the autonomous operation of mobile robots.As the complexity and randomness of robot application scenarios increase,the planning capability of the classical hierarchical motion planners is challenged.With the development of machine learning,the deep reinforcement learning(DRL)-based motion planner has gradually become a research hotspot due to its several advantageous feature.The DRL-based motion planner is model-free and does not rely on the prior structured map.Most importantly,the DRL-based motion planner achieves the unification of the global planner and the local planner.In this paper,we provide a systematic review of various motion planning methods.Firstly,we summarize the representative and state-of-the-art works for each submodule of the classical motion planning architecture and analyze their performance features.Then,we concentrate on summarizing reinforcement learning(RL)-based motion planning approaches,including motion planners combined with RL improvements,map-free RL-based motion planners,and multi-robot cooperative planning methods.Finally,we analyze the urgent challenges faced by these mainstream RLbased motion planners in detail,review some state-of-the-art works for these issues,and propose suggestions for future research. 展开更多
关键词 mobile robot reinforcement learning(RL) motion planning multi-robot cooperative planning
下载PDF
Artificial Potential Field Incorporated Deep-Q-Network Algorithm for Mobile Robot Path Prediction
5
作者 A.Sivaranjani B.Vinod 《Intelligent Automation & Soft Computing》 SCIE 2023年第1期1135-1150,共16页
Autonomous navigation of mobile robots is a challenging task that requires them to travel from their initial position to their destination without collision in an environment.Reinforcement Learning methods enable a st... Autonomous navigation of mobile robots is a challenging task that requires them to travel from their initial position to their destination without collision in an environment.Reinforcement Learning methods enable a state action function in mobile robots suited to their environment.During trial-and-error interaction with its surroundings,it helps a robot tofind an ideal behavior on its own.The Deep Q Network(DQN)algorithm is used in TurtleBot 3(TB3)to achieve the goal by successfully avoiding the obstacles.But it requires a large number of training iterations.This research mainly focuses on a mobility robot’s best path prediction utilizing DQN and the Artificial Potential Field(APF)algorithms.First,a TB3 Waffle Pi DQN is built and trained to reach the goal.Then the APF shortest path algorithm is incorporated into the DQN algorithm.The proposed planning approach is compared with the standard DQN method in a virtual environment based on the Robot Operation System(ROS).The results from the simulation show that the combination is effective for DQN and APF gives a better optimal path and takes less time when compared to the conventional DQN algo-rithm.The performance improvement rate of the proposed DQN+APF in comparison with DQN in terms of the number of successful targets is attained by 88%.The performance of the proposed DQN+APF in comparison with DQN in terms of average time is achieved by 0.331 s.The performance of the proposed DQN+APF in comparison with DQN average rewards in which the positive goal is attained by 85%and the negative goal is attained by-90%. 展开更多
关键词 Artificial potentialfield deep reinforcement learning mobile robot turtle bot deep Q network path prediction
下载PDF
Novel ARC-Fuzzy Coordinated Automatic Tracking Control of Four-Wheeled Mobile Robot
6
作者 G.Pandiaraj S.Muralidharan 《Intelligent Automation & Soft Computing》 SCIE 2023年第3期3713-3726,共14页
Four-wheeled,individual-driven,nonholonomic structured mobile robots are widely used in industries for automated work,inspection and explora-tion purposes.The trajectory tracking control of the four-wheel individual-d... Four-wheeled,individual-driven,nonholonomic structured mobile robots are widely used in industries for automated work,inspection and explora-tion purposes.The trajectory tracking control of the four-wheel individual-driven mobile robot is one of the most blooming research topics due to its nonholonomic structure.The wheel velocities are separately adjusted to follow the trajectory in the old-fashioned kinematic control of skid-steered mobile robots.However,there is no consideration for robot dynamics when using a kinematic controller that solely addresses the robot chassis’s motion.As a result,the mobile robot has lim-ited performance,such as chattering during curved movement.In this research work,a three-tiered adaptive robust control with fuzzy parameter estimation,including dynamic modeling,direct torque control and wheel slip control is pro-posed.Fuzzy logic-based parameter estimation is a valuable tool for adjusting adaptive robust controller(ARC)parameters and tracking the trajectories with less tracking error as well as high tracking accuracy.This research considers the O type and 8 type trajectories for performance analysis of the proposed novel control technique.Our suggested approach outperforms the existing control methods such as Fuzzy,proportional–integral–derivative(PID)and adaptive robust controller with discrete projection(ARC–DP).The experimental results show that the scheduled performance index decreases by 2.77%and 4.76%.All the experimen-tal simulations obviously proved that the proposed ARC-Fuzzy performed well in smooth groud surfaces compared to other approaches. 展开更多
关键词 Adaptive robust control coordinated control mobile robot fuzzy adaptation law fuzzy parameter adjustment direct torque allocation
下载PDF
A dynamic fusion path planning algorithm for mobile robots incorporating improved IB-RRT∗and deep reinforcement learning
7
作者 刘安东 ZHANG Baixin +2 位作者 CUI Qi ZHANG Dan NI Hongjie 《High Technology Letters》 EI CAS 2023年第4期365-376,共12页
Dynamic path planning is crucial for mobile robots to navigate successfully in unstructured envi-ronments.To achieve globally optimal path and real-time dynamic obstacle avoidance during the movement,a dynamic path pl... Dynamic path planning is crucial for mobile robots to navigate successfully in unstructured envi-ronments.To achieve globally optimal path and real-time dynamic obstacle avoidance during the movement,a dynamic path planning algorithm incorporating improved IB-RRT∗and deep reinforce-ment learning(DRL)is proposed.Firstly,an improved IB-RRT∗algorithm is proposed for global path planning by combining double elliptic subset sampling and probabilistic central circle target bi-as.Then,to tackle the slow response to dynamic obstacles and inadequate obstacle avoidance of tra-ditional local path planning algorithms,deep reinforcement learning is utilized to predict the move-ment trend of dynamic obstacles,leading to a dynamic fusion path planning.Finally,the simulation and experiment results demonstrate that the proposed improved IB-RRT∗algorithm has higher con-vergence speed and search efficiency compared with traditional Bi-RRT∗,Informed-RRT∗,and IB-RRT∗algorithms.Furthermore,the proposed fusion algorithm can effectively perform real-time obsta-cle avoidance and navigation tasks for mobile robots in unstructured environments. 展开更多
关键词 mobile robot improved IB-RRT∗algorithm deep reinforcement learning(DRL) real-time dynamic obstacle avoidance
下载PDF
Cost-effective distributed FTFC for uncertain nonholonomic mobile robot fleet with collision avoidance and connectivity preservation
8
作者 Xiucai Huang Zhengguo Li Frank L.Lewis 《Journal of Automation and Intelligence》 2023年第1期42-50,共9页
In this paper,the fault-tolerant formation control(FTFC)problem is investigated for a group of uncertain nonholonomic mobile robots with limited communication ranges and unpredicted actuator faults,where the communica... In this paper,the fault-tolerant formation control(FTFC)problem is investigated for a group of uncertain nonholonomic mobile robots with limited communication ranges and unpredicted actuator faults,where the communication between the robots is in a directed one-to-one way.In order to guarantee the connectivity preservation and collision avoidance among the robots,some properly chosen performance functions are incorporated into the controller to per-assign the asymmetrical bounds for relative distance and bearing angle between each pair of adjacent mobile robots.Particularly,the resultant control scheme remains at a costeffective level because its design does not use any velocity information from neighbors,any prior knowledge of system nonlinearities or any nonlinear approximator to account for them despite the presence of modeling uncertainties,unknown external disturbances,and unexpected actuator faults.Meanwhile,each follower is derived to track the leader with the tracking errors regarding relative distance and bearing angle subject to prescribed transient and steady-state performance guarantees,respectively.Moreover,all the closed-loop signals are ensured to be ultimately uniformly bounded.Finally,a numerical example is simulated to verify the effectiveness of this methodology. 展开更多
关键词 Fault-tolerant formation control Nonholonomic mobile robot Connectivity preservation Collision avoidance
下载PDF
Kinematics Modeling of an Omnidirectional Autonomous Mobile Robot with Castor Wheels
9
作者 彭忆强 《Journal of Southwest Jiaotong University(English Edition)》 2006年第4期348-354,共7页
The kinematics model of an omnidirectional wheeled mobile robot (WMR) platform with 3 castor wheels was built, which includes the actuated inverse solution and the sensed forward solution. Motion simulations verify ... The kinematics model of an omnidirectional wheeled mobile robot (WMR) platform with 3 castor wheels was built, which includes the actuated inverse solution and the sensed forward solution. Motion simulations verify the consistency between the actuated inverse solution and the sensed forward solution. Analysis results show that the WMR possesses 3 degrees of freedom, and its motion trajectory is a straight line. The "pushing" and "pulling" motion patterns of the WMR can be generated by using different wheel orientations. It can be used in the places where the space is limited. 展开更多
关键词 Wheeled mobile robot Omnidirectional wheeled mobile robot KINEMATICS
下载PDF
Mobile Robot Indoor Autonomous Navigation with Position Estimation Using RF Signal Triangulation
10
作者 Leonimer Flávio de Melo Joao Mauricio Rosario Almiro Franco da Silveira Junior 《Positioning》 2013年第1期20-35,共16页
In the mobile robotic systems a precise estimate of the robot pose (Cartesian [x y] position plus orientation angle theta) with the intention of the path planning optimization is essential for the correct performance,... In the mobile robotic systems a precise estimate of the robot pose (Cartesian [x y] position plus orientation angle theta) with the intention of the path planning optimization is essential for the correct performance, on the part of the robots, for tasks that are destined to it, especially when intention is for mobile robot autonomous navigation. This work uses a ToF (Time-of-Flight) of the RF digital signal interacting with beacons for computational triangulation in the way to provide a pose estimative at bi-dimensional indoor environment, where GPS system is out of range. It’s a new technology utilization making good use of old ultrasonic ToF methodology that takes advantage of high performance multicore DSP processors to calculate ToF of the order about ns. Sensors data like odometry, compass and the result of triangulation Cartesian estimative, are fused in a Kalman filter in the way to perform optimal estimation and correct robot pose. A mobile robot platform with differential drive and nonholonomic constraints is used as base for state space, plants and measurements models that are used in the simulations and for validation the experiments. 展开更多
关键词 mobile robotic Systems Path Planning mobile robot Autonomous Navigation Pose Estimation
下载PDF
DEVELOPMENT AND MOTION ANALYSIS OF MINIATURE WHEEL-TRACK-LEGGED MOBILE ROBOT 被引量:11
11
作者 DUAN Xingguang HUANG Qiang +2 位作者 XU Yan RAHMAN N ZHENG Change 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2007年第3期24-28,共5页
A miniature wheel-track-legged mobile robot to carry out military and civilian missions in both indoor and outdoor environments is presented. Firstly, the mechanical design is discussed, which consists of four wheeled... A miniature wheel-track-legged mobile robot to carry out military and civilian missions in both indoor and outdoor environments is presented. Firstly, the mechanical design is discussed, which consists of four wheeled and four independently controlled tracked arms, embedded control system and teleoperation. Then the locomotion modes of the mobile robot and motion analysis are analyzed. The mobile robot can move using wheeled, tracked and legged modes, and it has the characteristics of posture-recovering, high mobility, small size and light weight. Finally, the effectiveness of the deve-loped mobile robot is confirmed by experiments such as posture recovering when tipped over, climb-ing stairs and traversing the high step. 展开更多
关键词 mobile robot Locomotion modes STAIR-CLIMBING Posture recovery
下载PDF
Adaptive Trajectory Tracking Control for a Nonholonomic Mobile Robot 被引量:13
12
作者 CAO Zhengcai ZHAO Yingtao WU Qidi 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2011年第4期546-552,共7页
As one of the core issues of the mobile robot motion control, trajectory tracking has received extensive attention. At present, the solution of the problem only takes kinematic or dynamic model into account separately... As one of the core issues of the mobile robot motion control, trajectory tracking has received extensive attention. At present, the solution of the problem only takes kinematic or dynamic model into account separately, so that the presented strategy is difficult to realize satisfactory tracking quality in practical application. Considering the unknown parameters of two models, this paper presents an adaptive controller for solving the trajectory tracking problem of a mobile robot. Firstly, an adaptive kinematic controller utilized to generate the command of velocity is designed based on Backstepping method. Then, in order to make the real velocity of mobile robot reach the desired velocity asymptotically, a dynamic adaptive controller is proposed adopting reference model and Lyapunov stability theory. Finally, through simulating typical trajectories including circular trajectory, fold line and parabola trajectory in normal and perturbed cases, the results illustrate that the control scheme can solve the tracking problem effectively. The proposed control law, which can tune the kinematic and dynamic model parameters online and overcome external disturbances, provides a novel method for improving trajectory tracking performance of the mobile robot. 展开更多
关键词 nonholonomic mobile robot trajectory tracking model reference adaptive
下载PDF
Robust adaptive control for a nonholonomic mobile robot with unknown parameters 被引量:9
13
作者 Jinbo WU Guohua XU Zhouping YIN 《控制理论与应用(英文版)》 EI 2009年第2期212-218,共7页
A robust adaptive controller for a nonholonomic mobile robot with unknown kinematic and dynamic parameters is proposed. A kinematic controller whose output is the input of the relevant dynamic controller is provided b... A robust adaptive controller for a nonholonomic mobile robot with unknown kinematic and dynamic parameters is proposed. A kinematic controller whose output is the input of the relevant dynamic controller is provided by using the concept of backstepping. An adaptive algorithm is developed in the kinematic controller to approximate the unknown kinematic parameters, and a simple single-layer neural network is used to express the highly nonlinear robot dynamics in terms of the known and unknown parameters. In order to attenuate the effects of the uncertainties and disturbances on tracking performance, a sliding mode control term is added to the dynamic controller. In the deterministic design of feedback controllers for the uncertain dynamic systems, upper bounds on the norm of the uncertainties are an important clue to guarantee the stability of the closed-loop system. However, sometimes these upper bounds may not be easily obtained because of the complexity of the structure of the uncertainties. Thereby, simple adaptation laws are proposed to approximate upper bounds on the norm of the uncertainties to address this problem. The stability of the proposed control system is shown through the Lyapunov method. Lastly, a design example for a mobile robot with two actuated wheels is provided and the feasibility of the controller is demonstrated by numerical simulations. 展开更多
关键词 Nonholonomic constraints mobile robot Sliding mode control Adaptive control ROBUSTNESS Neural network
下载PDF
Ellipsoidal bounding set-membership identification approach for robust fault diagnosis with application to mobile robots 被引量:7
14
作者 Bo Zhou Kun Qian +1 位作者 Xudong Ma Xianzhong Dai 《Journal of Systems Engineering and Electronics》 SCIE EI CSCD 2017年第5期986-995,共10页
A robust fault diagnosis approach is developed by incorporating a set-membership identification (SMI) method. A class of systems with linear models in the form of fault related parameters is investigated, with model u... A robust fault diagnosis approach is developed by incorporating a set-membership identification (SMI) method. A class of systems with linear models in the form of fault related parameters is investigated, with model uncertainties and parameter variations taken into account explicitly and treated as bounded errors. An ellipsoid bounding set-membership identification algorithm is proposed to propagate bounded uncertainties rigorously and the guaranteed feasible set of faults parameters enveloping true parameter values is given. Faults arised from abrupt parameter variations can be detected and isolated on-line by consistency check between predicted and observed parameter sets obtained in the identification procedure. The proposed approach provides the improved robustness with its ability to distinguish real faults from model uncertainties, which comes with the inherent guaranteed robustness of the set-membership framework. Efforts are also made in this work to balance between conservativeness and computation complexity of the overall algorithm. Simulation results for the mobile robot with several slipping faults scenarios demonstrate the correctness of the proposed approach for faults detection and isolation (FDI). 展开更多
关键词 set-membership identification fault diagnosis fault detection and isolation (FDI) bounded error mobile robot
下载PDF
Robust Tracking Control for Self-balancing Mobile Robots Using Disturbance Observer 被引量:8
15
作者 Mou Chen 《IEEE/CAA Journal of Automatica Sinica》 SCIE EI CSCD 2017年第3期458-465,共8页
In this paper,a robust tracking control scheme based on nonlinear disturbance observer is developed for the self-balancing mobile robot with external unknown disturbances.A desired velocity control law is firstly desi... In this paper,a robust tracking control scheme based on nonlinear disturbance observer is developed for the self-balancing mobile robot with external unknown disturbances.A desired velocity control law is firstly designed using the Lyapunov analysis method and the arctan function.To improve the tracking control performance,a nonlinear disturbance observer is developed to estimate the unknown disturbance of the self-balancing mobile robot.Using the output of the designed disturbance observer,the robust tracking control scheme is presented employing the sliding mode method for the selfbalancing mobile robot.Numerical simulation results further demonstrate the effectiveness of the proposed robust tracking control scheme for the self-balancing mobile robot subject to external unknown disturbances. 展开更多
关键词 Disturbance observer robust tracking control self-balancing mobile robot sliding mode control(SMC)
下载PDF
Improved Dijkstra Algorithm for Mobile Robot Path Planning and Obstacle Avoidance 被引量:6
16
作者 Shaher Alshammrei Sahbi Boubaker Lioua Kolsi 《Computers, Materials & Continua》 SCIE EI 2022年第9期5939-5954,共16页
Optimal path planning avoiding obstacles is among the most attractive applications of mobile robots(MRs)in both research and education.In this paper,an optimal collision-free algorithm is designed and implemented prac... Optimal path planning avoiding obstacles is among the most attractive applications of mobile robots(MRs)in both research and education.In this paper,an optimal collision-free algorithm is designed and implemented practically based on an improved Dijkstra algorithm.To achieve this research objectives,first,the MR obstacle-free environment is modeled as a diagraph including nodes,edges and weights.Second,Dijkstra algorithm is used offline to generate the shortest path driving the MR from a starting point to a target point.During its movement,the robot should follow the previously obtained path and stop at each node to test if there is an obstacle between the current node and the immediately following node.For this aim,the MR was equipped with an ultrasonic sensor used as obstacle detector.If an obstacle is found,the MR updates its diagraph by excluding the corresponding node.Then,Dijkstra algorithm runs on the modified diagraph.This procedure is repeated until reaching the target point.To verify the efficiency of the proposed approach,a simulation was carried out on a hand-made MR and an environment including 9 nodes,19 edges and 2 obstacles.The obtained optimal path avoiding obstacles has been transferred into motion control and implemented practically using line tracking sensors.This study has shown that the improved Dijkstra algorithm can efficiently solve optimal path planning in environments including obstacles and that STEAM-based MRs are efficient cost-effective tools to practically implement the designed algorithm. 展开更多
关键词 mobile robot(MR) STEAM path planning obstacle avoidance improved dijkstra algorithm
下载PDF
Vision-based Stabilization of Nonholonomic Mobile Robots by Integrating Sliding-mode Control and Adaptive Approach 被引量:4
17
作者 CAO Zhengcai YIN Longjie FU Yili 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2013年第1期21-28,共8页
Vision-based pose stabilization of nonholonomic mobile robots has received extensive attention. At present, most of the solutions of the problem do not take the robot dynamics into account in the controller design, so... Vision-based pose stabilization of nonholonomic mobile robots has received extensive attention. At present, most of the solutions of the problem do not take the robot dynamics into account in the controller design, so that these controllers are difficult to realize satisfactory control in practical application. Besides, many of the approaches suffer from the initial speed and torque jump which are not practical in the real world. Considering the kinematics and dynamics, a two-stage visual controller for solving the stabilization problem of a mobile robot is presented, applying the integration of adaptive control, sliding-mode control, and neural dynamics. In the first stage, an adaptive kinematic stabilization controller utilized to generate the command of velocity is developed based on Lyapunov theory. In the second stage, adopting the sliding-mode control approach, a dynamic controller with a variable speed function used to reduce the chattering is designed, which is utilized to generate the command of torque to make the actual velocity of the mobile robot asymptotically reach the desired velocity. Furthermore, to handle the speed and torque jump problems, the neural dynamics model is integrated into the above mentioned controllers. The stability of the proposed control system is analyzed by using Lyapunov theory. Finally, the simulation of the control law is implemented in perturbed case, and the results show that the control scheme can solve the stabilization problem effectively. The proposed control law can solve the speed and torque jump problems, overcome external disturbances, and provide a new solution for the vision-based stabilization of the mobile robot. 展开更多
关键词 nonholonomic mobile robots vision-based stabilization sliding-mode control adaptive control neural dynamics
下载PDF
Backstepping Based Global Exponential Stabilization of a Tracked Mobile Robot with Slipping Perturbation 被引量:4
18
作者 Bo Zhou Jianda Han Xianzhong Dai 《Journal of Bionic Engineering》 SCIE EI CSCD 2011年第1期69-76,共8页
While the nonholonomic robots with no-slipping constraints are studied extensively nowadays, the slipping effect is inevitable in many practical applications and should be considered necessarily to achieve autonomous ... While the nonholonomic robots with no-slipping constraints are studied extensively nowadays, the slipping effect is inevitable in many practical applications and should be considered necessarily to achieve autonomous navigation and control purposes especially in outdoor environments. In this paper the robust point stabilization problem of a tracked mobile robot is discussed in the presence of track slipping, which can be treated as model perturbation that violates the pure nonholonomic constraints. The kinematic model of the tracked vehicle is created, in which the slipping is assumed to be a time-varying pa- rameter under certain assumptions of track-soil interaction. By transforming the original system to the special chained form of nonholonomic system, the integrator backstepping procedure with a state-scaling technique is used to construct the controller to stabilize the system at the kinematic level. The global exponential stability of the final system can be guaranteed by Lyapunov theory. Simulation results with different initial states and slipping parameters demonstrate the fast convergence, robustness and insensitivity to the initial state of the proposed method. 展开更多
关键词 tracked mobile robot nonholonomic system STABILIZATION BACKSTEPPING Lyapunov function
下载PDF
Target Tracking Algorithm Using Finite-time Convergence Smooth Second-order Sliding Mode Controller for Mobile Robots 被引量:4
19
作者 GE Lianzheng ZHAO Lijun GAO Tong 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2011年第3期414-419,共6页
Target tracking control for wheeled mobile robot (WMR) need resolve the problems of kinematics model and tracking algorithm.High-order sliding mode control is a valid method used in the nonlinear tracking control sy... Target tracking control for wheeled mobile robot (WMR) need resolve the problems of kinematics model and tracking algorithm.High-order sliding mode control is a valid method used in the nonlinear tracking control system,which can eliminate the chattering of sliding mode control.Currently there lacks the research of robustness and uncertain factors for high-order sliding mode control.To address the fast convergence and robustness problems of tracking target,the tracking mathematical model of WMR and the target is derived.Based on the finite-time convergence theory and second order sliding mode method,a nonlinear tracking algorithm is designed which guarantees that WMR can catch the target in finite time.At the same time an observer is applied to substitute the uncertain acceleration of the target,then a smooth nonlinear tracking algorithm is proposed.Based on Lyapunov stability theory and finite-time convergence,a finite time convergent smooth second order sliding mode controller and a target tracking algorithm are designed by using second order sliding mode method.The simulation results verified that WMR can catch up the target quickly and reduce the control discontinuity of the velocity of WMR. 展开更多
关键词 mobile robots second order sliding mode finite-time convergence OBSERVER
下载PDF
A Switching Controller System for a Wheeled Mobile Robot 被引量:4
20
作者 Masanori Sato Atushi Kanda Kazuo Ishii 《Journal of Bionic Engineering》 SCIE EI CSCD 2007年第4期281-289,共9页
A wheeled mobile mechanism with a passive and/or active linkage mechanism for rough terrain environment is developed and evaluated. The wheeled mobile mechanism which has high mobility in rough terrain needs sophistic... A wheeled mobile mechanism with a passive and/or active linkage mechanism for rough terrain environment is developed and evaluated. The wheeled mobile mechanism which has high mobility in rough terrain needs sophisticated system to adapt various environments. We focus on the development of a switching controller system for wheeled mobile robots in rough terrain. This system consists of two sub-systems: an environment recognition system using link angles and an adaptive control system. In the environment recognition system, we introduce a Self-Organizing Map (SOM) for clustering link angles. In the adaptive controllers, we introduce neural networks to calculate the inverse model of the wheeled mobile robot. The environment recognition system can recognize the environment in which the robot travels, and the adjustable controllers are tuned by experimental results for each environment. The dual sub-system switching controller system is experimentally evaluated. The system recognizes its environment and adapts by switching the adjustable controllers. This system demonstrates superior performance to a well-tuned single PID controller. 展开更多
关键词 mobile robot rough terrain neural network Self-Organizing Map
下载PDF
上一页 1 2 7 下一页 到第
使用帮助 返回顶部