期刊文献+
共找到2,935篇文章
< 1 2 147 >
每页显示 20 50 100
Heuristic Expanding Disconnected Graph:A Rapid Path Planning Method for Mobile Robots
1
作者 Yong Tao Lian Duan +3 位作者 He Gao Yufan Zhang Yian Song Tianmiao Wang 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2024年第2期68-82,共15页
Existing mobile robots mostly use graph search algorithms for path planning,which suffer from relatively low planning efficiency owing to high redundancy and large computational complexity.Due to the limitations of th... Existing mobile robots mostly use graph search algorithms for path planning,which suffer from relatively low planning efficiency owing to high redundancy and large computational complexity.Due to the limitations of the neighborhood search strategy,the robots could hardly obtain the most optimal global path.A global path planning algorithm,denoted as EDG*,is proposed by expanding nodes using a well-designed expanding disconnected graph operator(EDG)in this paper.Firstly,all obstacles are marked and their corners are located through the map pre-processing.Then,the EDG operator is designed to find points in non-obstruction areas to complete the rapid expansion of disconnected nodes.Finally,the EDG*heuristic iterative algorithm is proposed.It selects the candidate node through a specific valuation function and realizes the node expansion while avoiding collision with a minimum offset.Path planning experiments were conducted in a typical indoor environment and on the public dataset CSM.The result shows that the proposed EDG*reduced the planning time by more than 90%and total length of paths reduced by more than 4.6%.Compared to A*,Dijkstra and JPS,EDG*does not show an exponential explosion effect in map size.The EDG*showed better performance in terms of path smoothness,and collision avoidance.This shows that the EDG*algorithm proposed in this paper can improve the efficiency of path planning and enhance path quality. 展开更多
关键词 Global path planning Mobile robot Expanding disconnected graph Edge node OFFSET
下载PDF
A path planning method for robot patrol inspection in chemical industrial parks
2
作者 王伟峰 YANG Ze +1 位作者 LI Zhao ZHAO Xuanchong 《High Technology Letters》 EI CAS 2024年第2期109-116,共8页
Safety patrol inspection in chemical industrial parks is a complex multi-objective task with multiple degrees of freedom.Traditional pointer instruments with advantages like high reliability and strong adaptability to... Safety patrol inspection in chemical industrial parks is a complex multi-objective task with multiple degrees of freedom.Traditional pointer instruments with advantages like high reliability and strong adaptability to harsh environment,are widely applied in such parks.However,they rely on manual readings which have problems like heavy patrol workload,high labor cost,high false positives/negatives and poor timeliness.To address the above problems,this study proposes a path planning method for robot patrol in chemical industrial parks,where a path optimization model based on improved iterated local search and random variable neighborhood descent(ILS-RVND)algorithm is established by integrating the actual requirements of patrol tasks in chemical industrial parks.Further,the effectiveness of the model and algorithm is verified by taking real park data as an example.The results show that compared with GA and ILS-RVND,the improved algorithm reduces quantification cost by about 24%and saves patrol time by about 36%.Apart from shortening the patrol time of robots,optimizing their patrol path and reducing their maintenance loss,the proposed algorithm also avoids the untimely patrol of robots and enhances the safety factor of equipment. 展开更多
关键词 path planning robot patrol inspection iterated local search and random variableneighborhood descent(ILS-RVND)algorithm
下载PDF
Path Planning for Robotic Arms Based on an Improved RRT Algorithm
3
作者 Wei Liu Zhennan Huang +1 位作者 Yingpeng Qu Long Chen 《Open Journal of Applied Sciences》 2024年第5期1214-1236,共23页
The burgeoning robotics industry has catalyzed significant strides in the development and deployment of industrial and service robotic arms, positioning path planning as a pivotal facet for augmenting their operationa... The burgeoning robotics industry has catalyzed significant strides in the development and deployment of industrial and service robotic arms, positioning path planning as a pivotal facet for augmenting their operational safety and efficiency. Existing path planning algorithms, while capable of delineating feasible trajectories, often fall short of achieving optimality, particularly concerning path length, search duration, and success likelihood. This study introduces an enhanced Rapidly-Exploring Random Tree (RRT) algorithm, meticulously designed to rectify the issues of node redundancy and the compromised path quality endemic to conventional RRT approaches. Through the integration of an adaptive pruning mechanism and a dynamic elliptical search strategy within the Informed RRT* framework, our algorithm efficiently refines the search tree by discarding branches that surpass the cost of the optimal path, thereby refining the search space and significantly boosting efficiency. Extensive comparative analysis across both two-dimensional and three-dimensional simulation settings underscores the algorithm’s proficiency in markedly improving path precision and search velocity, signifying a breakthrough in the domain of robotic arm path planning. 展开更多
关键词 robotic Arm path planning RRT Algorithm Adaptive Pruning Optimization
下载PDF
Complete Coverage Path Planning Based on Improved Area Division
4
作者 Lihuan Ma Zhuo Sun Yuan Gao 《World Journal of Engineering and Technology》 2023年第4期965-975,共11页
It is difficult to solve complete coverage path planning directly in the obstructed area. Therefore, in this paper, we propose a method of complete coverage path planning with improved area division. Firstly, the bous... It is difficult to solve complete coverage path planning directly in the obstructed area. Therefore, in this paper, we propose a method of complete coverage path planning with improved area division. Firstly, the boustrophedon cell decomposition method is used to partition the map into sub-regions. The complete coverage paths within each sub-region are obtained by the Boustrophedon back-and-forth motions, and the order of traversal of the sub-regions is then described as a generalised traveling salesman problem with pickup and delivery based on the relative positions of the vertices of each sub-region. An adaptive large neighbourhood algorithm is proposed to quickly obtain solution results in traversal order. The effectiveness of the improved algorithm on traversal cost reduction is verified in this paper through multiple sets of experiments. . 展开更多
关键词 Generalized Traveling Salesman Problem with Pickup and Delivery Com-plete Coverage path planning Boustrophedon Cellular Decomposition Adaptive Large-Neighborhood Search Algorithm Mobile robot
下载PDF
A review:On path planning strategies for navigation of mobile robot 被引量:66
5
作者 B.K. Patle Ganesh Babu L +2 位作者 Anish Pandey D.R.K. Parhi A. Jagadeesh 《Defence Technology(防务技术)》 SCIE EI CAS CSCD 2019年第4期582-606,共25页
This paper presents the rigorous study of mobile robot navigation techniques used so far.The step by step investigations of classical and reactive approaches are made here to understand the development of path plannin... This paper presents the rigorous study of mobile robot navigation techniques used so far.The step by step investigations of classical and reactive approaches are made here to understand the development of path planning strategies in various environmental conditions and to identify research gap.The classical approaches such as cell decomposition(CD),roadmap approach(RA),artificial potential field(APF);reactive approaches such as genetic algorithm(GA),fuzzy logic(FL),neural network(NN),firefly algorithm(FA),particle swarm optimization(PSO),ant colony optimization(ACO),bacterial foraging optimization(BFO),artificial bee colony(ABC),cuckoo search(CS),shuffled frog leaping algorithm(SFLA)and other miscellaneous algorithms(OMA)are considered for study.The navigation over static and dynamic condition is analyzed(for single and multiple robot systems)and it has been observed that the reactive approaches are more robust and perform well in all terrain when compared to classical approaches.It is also observed that the reactive approaches are used to improve the performance of the classical approaches as a hybrid algorithm.Hence,reactive approaches are more popular and widely used for path planning of mobile robot.The paper concludes with tabular data and charts comparing the frequency of individual navigational strategies which can be used for specific application in robotics. 展开更多
关键词 Mobile robot NAVIGATION path planning CLASSICAL APPROACHES Reactive APPROACHES Artificial INTELLIGENCE
下载PDF
Tracking Control for a Cushion Robot Based on Fuzzy Path Planning With Safe Angular Velocity 被引量:7
6
作者 Ping Sun Zhuang Yu 《IEEE/CAA Journal of Automatica Sinica》 SCIE EI CSCD 2017年第4期610-619,共10页
This study proposes a new nonlinear tracking control method with safe angular velocity constraints for a cushion robot. A fuzzy path planning algorithm is investigated and a realtime desired motion path of obstacle av... This study proposes a new nonlinear tracking control method with safe angular velocity constraints for a cushion robot. A fuzzy path planning algorithm is investigated and a realtime desired motion path of obstacle avoidance is obtained. The angular velocity is constrained by the controller, so the planned path guarantees the safety of users. According to Lyapunov theory, the controller is designed to maintain stability in terms of solutions of linear matrix inequalities and the controller's performance with safe angular velocity constraints is derived.The simulation and experiment results confirm the effectiveness of the proposed method and verify that the angular velocity of the cushion robot provided safe motion with obstacle avoidance. 展开更多
关键词 Cushion robot path planning safe angular velocity tracking control
下载PDF
A Rough Set GA-based Hybrid Method for Robot Path Planning 被引量:6
7
作者 Cheng-Dong Wu Ying Zhang +1 位作者 Meng-Xin Li Yong Yue 《International Journal of Automation and computing》 EI 2006年第1期29-34,共6页
In this paper, a hybrid method based on rough sets and genetic algorithms, is proposed to improve the speed of robot path planning. Decision rules are obtained using rough set theory. A series of available paths are p... In this paper, a hybrid method based on rough sets and genetic algorithms, is proposed to improve the speed of robot path planning. Decision rules are obtained using rough set theory. A series of available paths are produced by training obtained minimal decision rules. Path populations are optimised by using genetic algorithms until the best path is obtained. Experiment results show that this hybrid method is capable of improving robot path planning speed. 展开更多
关键词 Rough sets genetic algorithms robot path planning.
下载PDF
Improved Dijkstra Algorithm for Mobile Robot Path Planning and Obstacle Avoidance 被引量:7
8
作者 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
Path Planning of Continuum Robot Based on a New Improved Particle Swarm Optimization Algorithm 被引量:5
9
作者 Fang Gao Qiang Zhao Gui-Xian Li 《Journal of Harbin Institute of Technology(New Series)》 EI CAS 2013年第4期78-84,共7页
Continuum robot is a new type of biomimetic robot,which realizes the motion by bending some parts of its body.So its path planning becomes more difficult even compared with hyper-redundant robots.In this paper a circu... Continuum robot is a new type of biomimetic robot,which realizes the motion by bending some parts of its body.So its path planning becomes more difficult even compared with hyper-redundant robots.In this paper a circular arc spline interpolating method is proposed for the robot shape description,and a new two-stage position-selectable-updating particle swarm optimization(TPPSO)algorithm is put forward to solve this path planning problem.The algorithm decomposes the standard PSO velocity’s single-step updating formula into twostage multi-point updating,specifically adopting three points as candidates and selecting the best one as the updated position in the first half stage,and similarly taking seven points as candidates and selecting the best one as the final position in the last half stage.This scheme refines and widens each particle’s searching trajectory,increases the updating speed of the individual best,and improves the converging speed and precision.Aiming at the optimization objective to minimize the sum of all the motion displacements of every segmental points and all the axial stretching or contracting displacements of every segment,the TPPSO algorithm is used to solve the path planning problem.The detailed solution procedure is presented.Numerical examples of five path planning cases show that the proposed algorithm is simple,robust,and efficient. 展开更多
关键词 continuum robot path planning particle swarm optimization algorithm
下载PDF
Robot path planning in dynamic environment based on reinforcement learning 被引量:3
10
作者 庄晓东 孟庆春 +3 位作者 魏天滨 王旭柱 谭锐 李筱菁 《Journal of Harbin Institute of Technology(New Series)》 EI CAS 2001年第3期253-255,共3页
Proposes an adaptive learning method based on reinforcement learning for robot path planning problem, which enables the robot to adaptively learn and perform effective path planning, to avoid the moving obstacles and ... Proposes an adaptive learning method based on reinforcement learning for robot path planning problem, which enables the robot to adaptively learn and perform effective path planning, to avoid the moving obstacles and reach the target. Thereby achieving automatic construction of path planning strategy and making the system adaptive to multi robots system dynamic environments, and concludes from computer simulation experiment that the method is powerful to solve the problem of multi robot path planning, and it is a meaningful try to apply reinforcement learning techniques in multi robot systems to develop the system’s intelligence degree. 展开更多
关键词 reinforcement learning mobile robot path planning
下载PDF
Path planning based on sliding window and variant A* algorithm for quadruped robot 被引量:2
11
作者 张慧 Rong Xuewen +3 位作者 Li Yibin Li Bin Zhang Junwen Zhang Qin 《High Technology Letters》 EI CAS 2016年第3期334-342,共9页
In order to improve the adaptability of the quadruped robot in complex environments,a path planning method based on sliding window and variant A* algorithm for quadruped robot is presented. To improve the path plannin... In order to improve the adaptability of the quadruped robot in complex environments,a path planning method based on sliding window and variant A* algorithm for quadruped robot is presented. To improve the path planning efficiency and robot security,an incremental A* search algorithm( IA*) and the A* algorithm having obstacle grids extending( EA*) are proposed respectively. The IA* algorithm firstly searches an optimal path based on A* algorithm,then a new route from the current path to the new goal projection is added to generate a suboptimum route incrementally. In comparison with traditional method solving path planning problem from scratch,the IA* enables the robot to plan path more efficiently. EA* extends the obstacle by means of increasing grid g-value,which makes the route far away from the obstacle and avoids blocking the narrow passage. To navigate the robot running smoothly,a quadratic B-spline interpolation is applied to smooth the path.Simulation results illustrate that the IA* algorithm can increase the re-planning efficiency more than 5 times and demonstrate the effectiveness of the EA* algorithm. 展开更多
关键词 QUADRUPED robot path planning SLIDING WINDOW A* ALGORITHM
下载PDF
Ant Colony Optimization with Potential Field Based on Grid Map for Mobile Robot Path Planning 被引量:4
12
作者 陈国良 刘杰 张钏钏 《Journal of Donghua University(English Edition)》 EI CAS 2016年第5期764-767,共4页
For the mobile robot path planning under the complex environment,ant colony optimization with artificial potential field based on grid map is proposed to avoid traditional ant colony algorithm's poor convergence a... For the mobile robot path planning under the complex environment,ant colony optimization with artificial potential field based on grid map is proposed to avoid traditional ant colony algorithm's poor convergence and local optimum.Firstly,the pheromone updating mechanism of ant colony is designed by a hybrid strategy of global map updating and local grids updating.Then,some angles between the vectors of artificial potential field and the orientations of current grid are introduced to calculate the visibility of eight-neighbor cells of cellular automata,which are adopted as ant colony's inspiring factor to calculate the transition probability based on the pseudo-random transition rule cellular automata.Finally,mobile robot dynamic path planning and the simulation experiments are completed by this algorithm,and the experimental results show that the method is feasible and effective. 展开更多
关键词 mobile robot path planning grid map artificial potential field ant colony algorithm
下载PDF
Intelligent learning technique based-on fuzzy logic for multi-robot path planning 被引量:2
13
作者 孟庆春 殷波 +3 位作者 熊建设 魏天滨 王旭柱 王汝霖 《Journal of Harbin Institute of Technology(New Series)》 EI CAS 2001年第3期222-227,共6页
Soccer robot system is a tremendously challenging intelligent system developed to mimic human soccer competition based on the multi discipline research: robotics, intelligent control, computer vision, etc. robot path ... Soccer robot system is a tremendously challenging intelligent system developed to mimic human soccer competition based on the multi discipline research: robotics, intelligent control, computer vision, etc. robot path planning strategy is a very important subject concerning to the performance and intelligence degree of the multi robot system. Therefore, this paper studies the path planning strategy of soccer system by using fuzzy logic. After setting up two fuzziers and two sorts of fuzzy rules for soccer system, fuzzy logic is applied to workspace partition and path revision. The experiment results show that this technique can well enhance the performance and intelligence degree of the system. 展开更多
关键词 fuzzy logic multi agent system intelligent system robot path planning
下载PDF
Experimental study of path planning problem using EMCOA for a holonomic mobile robot 被引量:3
14
作者 MOHSENI Alireza DUCHAINE Vincent WONG Tony 《Journal of Systems Engineering and Electronics》 SCIE EI CSCD 2021年第6期1450-1462,共13页
In this paper,a comparative study of the path planning problem using evolutionary algorithms,in comparison with classical methods such as the A*algorithm,is presented for a holonomic mobile robot.The configured naviga... In this paper,a comparative study of the path planning problem using evolutionary algorithms,in comparison with classical methods such as the A*algorithm,is presented for a holonomic mobile robot.The configured navigation system,which consists of the integration of sensors sources,map formatting,global and local path planners,and the base controller,aims to enable the robot to follow the shortest smooth path delicately.Grid-based mapping is used for scoring paths efficiently,allowing the determination of collision-free trajectories from the initial to the target position.This work considers the evolutionary algorithms,the mutated cuckoo optimization algorithm(MCOA)and the genetic algorithm(GA),as a global planner to find the shortest safe path among others.A non-uniform motion coefficient is introduced for MCOA in order to increase the performance of this algorithm.A series of experiments are accomplished and analyzed to confirm the performance of the global planner implemented on a holonomic mobile robot.The results of the experiments show the capacity of the planner framework with respect to the path planning problem under various obstacle layouts. 展开更多
关键词 holonomic robot path planning evolutionary algorithm(EA)
下载PDF
Mobile robot path planning based on adaptive bacterial foraging algorithm 被引量:7
15
作者 梁晓丹 李亮玉 +1 位作者 武继刚 陈瀚宁 《Journal of Central South University》 SCIE EI CAS 2013年第12期3391-3400,共10页
The utilization of biomimicry of bacterial foraging strategy was considered to develop an adaptive control strategy for mobile robot, and a bacterial foraging approach was proposed for robot path planning. In the prop... The utilization of biomimicry of bacterial foraging strategy was considered to develop an adaptive control strategy for mobile robot, and a bacterial foraging approach was proposed for robot path planning. In the proposed model, robot that mimics the behavior of bacteria is able to determine an optimal collision-free path between a start and a target point in the environment surrounded by obstacles. In the simulation, two test scenarios of static environment with different number obstacles were adopted to evaluate the performance of the proposed method. Simulation results show that the robot which reflects the bacterial foraging behavior can adapt to complex environments in the planned trajectories with both satisfactory accuracy and stability. 展开更多
关键词 机器入路径规划 自适应控制策略 觅食行为 移动机器人 细菌 算法 仿真结果 测试场景
下载PDF
Ant Colony System Algorithm for Real-Time Globally Optimal Path Planning of Mobile Robots 被引量:26
16
作者 TAN Guan-Zheng HE Huan SLOMAN Aaron 《自动化学报》 EI CSCD 北大核心 2007年第3期279-285,共7页
为活动机器人计划的即时全球性最佳的路径的一个新奇方法基于蚂蚁殖民地系统(交流) 被建议算法。这个方法包括三步:第一步正在利用 MAKLINK 图理论建立活动机器人的空间模型,第二步正在利用 Dijkstra 算法发现一条非最优的没有碰撞的... 为活动机器人计划的即时全球性最佳的路径的一个新奇方法基于蚂蚁殖民地系统(交流) 被建议算法。这个方法包括三步:第一步正在利用 MAKLINK 图理论建立活动机器人的空间模型,第二步正在利用 Dijkstra 算法发现一条非最优的没有碰撞的路径,并且第三步正在利用 ACS 算法优化非最优的路径的地点以便产生全球性最佳的路径。建议方法是有效的并且能在即时路径被使用活动机器人计划的计算机模拟实验表演的结果。建议方法比与优秀人材模型一起基于基因算法计划方法的路径处于集中速度,答案变化,动态集中行为,和计算效率有更好的性能,这被验证了。 展开更多
关键词 蚁群系统 运算法则 自动化系统 计算机技术
下载PDF
Planning of circlelocus for multi-path/multi-layer welding robot with automatical error-correction 被引量:1
17
作者 富历新 樊滨温 董春 《China Welding》 EI CAS 2000年第1期61-66,共6页
In this paper, a planning algorithm for multi path/multi layer circular locus is poposed. The algorithm is applied to weld the nipples on the header of boiler. Multi path/multi layer circular locus is planned acco... In this paper, a planning algorithm for multi path/multi layer circular locus is poposed. The algorithm is applied to weld the nipples on the header of boiler. Multi path/multi layer circular locus is planned according to three teaching points, which is lapped head on end to satisfy the requirement of technology. For the nipples wherever they are arranged radially or axially, even if there are errors caused by positioning and thermal deformations, providing that nipple's position and orientation relative to the teaching one can be measured, the multi path/multi layer circular locus can be planned without teaching any more. The algorithm has been applied in welding robot for manufacturing power station' boiler. 展开更多
关键词 error correction robot welding path planning head of boiler
下载PDF
Robot path planning using genetic algorithms 被引量:1
18
作者 朴松昊 洪炳熔 《Journal of Harbin Institute of Technology(New Series)》 EI CAS 2001年第3期215-217,共3页
Presents a strategy for soccer robot path planning using genetic algorithms for which, real number coding method is used, to overcome the defects of binary coding method, and the double crossover operation adopted, to... Presents a strategy for soccer robot path planning using genetic algorithms for which, real number coding method is used, to overcome the defects of binary coding method, and the double crossover operation adopted, to avoid the common defect of early convergence and converge faster than the standard genetic algorithms concludes from simulation results that the method is effective for robot path planning. 展开更多
关键词 path planning soccer robot genetic algorithms
下载PDF
NOVEL APPROACH FOR ROBOT PATH PLANNING BASED ON NUMERICAL ARTIFICIAL POTENTIAL FIELD AND GENETIC ALGORITHM 被引量:2
19
作者 WANG Weizhong ZHAO Jie GAO Yongsheng CAI Hegao 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2006年第3期340-343,共4页
A novel approach for collision-free path planning of a multiple degree-of-freedom (DOF) articulated robot in a complex environment is proposed. Firstly, based on visual neighbor point (VNP), a numerical artificial... A novel approach for collision-free path planning of a multiple degree-of-freedom (DOF) articulated robot in a complex environment is proposed. Firstly, based on visual neighbor point (VNP), a numerical artificial potential field is constructed in Cartesian space, which provides the heuristic information, effective distance to the goal and the motion direction for the motion of the robot joints. Secondly, a genetic algorithm, combined with the heuristic rules, is used in joint space to determine a series of contiguous configurations piecewise from initial configuration until the goal configuration is attained. A simulation shows that the method can not only handle issues on path planning of the articulated robots in environment with complex obstacles, but also improve the efficiency and quality of path planning. 展开更多
关键词 robot path planning Artificial potential field Genetic algorithm
下载PDF
Optimization of Path Planning for Construction Robots Based on Multiple Advanced Algorithms 被引量:1
20
作者 Kang Tan 《Journal of Computer and Communications》 2018年第7期1-13,共13页
There are many processes involved in construction, it is necessary to optimize the path planning of construction robots. Most researches focused more on optimization algorithms, but less on comparative analysis based ... There are many processes involved in construction, it is necessary to optimize the path planning of construction robots. Most researches focused more on optimization algorithms, but less on comparative analysis based on the advantages and shortcomings of these algorithms. Therefore, the innovation of this paper is to analyze three advanced optimization algorithms (genetic algorithm, hybrid particle swarm algorithm and ant colony algorithm) and discuss how these algorithms can improve the optimization performance by adjusting parameters. Finally, the three algorithms are compared and analyzed to find an optimization algorithm that is suitable for path planning optimization of construction robots. The purpose of the optimization is to obtain the maximum benefit with the least cost and complete project in an efficient and economical way. 展开更多
关键词 path planning Construction robotS OPTIMIZATION Algorithm
下载PDF
上一页 1 2 147 下一页 到第
使用帮助 返回顶部