WO2022124938A1 - Robot motion planning method and mobile robot - Google Patents

Robot motion planning method and mobile robot Download PDF

Info

Publication number
WO2022124938A1
WO2022124938A1 PCT/RU2021/050336 RU2021050336W WO2022124938A1 WO 2022124938 A1 WO2022124938 A1 WO 2022124938A1 RU 2021050336 W RU2021050336 W RU 2021050336W WO 2022124938 A1 WO2022124938 A1 WO 2022124938A1
Authority
WO
WIPO (PCT)
Prior art keywords
robot
elementary
movement
trajectory
area
Prior art date
Application number
PCT/RU2021/050336
Other languages
French (fr)
Russian (ru)
Inventor
Михаил Вячеславович ЕГОРЧЕВ
Андрей Андреевич ЗАВОДСКОВ
Original Assignee
Общество с ограниченной ответственностью "РобоСиВи"
Priority date (The priority date is an assumption and is not a legal conclusion. Google has not performed a legal analysis and makes no representation as to the accuracy of the date listed.)
Filing date
Publication date
Application filed by Общество с ограниченной ответственностью "РобоСиВи" filed Critical Общество с ограниченной ответственностью "РобоСиВи"
Publication of WO2022124938A1 publication Critical patent/WO2022124938A1/en

Links

Classifications

    • BPERFORMING OPERATIONS; TRANSPORTING
    • B25HAND TOOLS; PORTABLE POWER-DRIVEN TOOLS; MANIPULATORS
    • B25JMANIPULATORS; CHAMBERS PROVIDED WITH MANIPULATION DEVICES
    • B25J9/00Programme-controlled manipulators
    • BPERFORMING OPERATIONS; TRANSPORTING
    • B25HAND TOOLS; PORTABLE POWER-DRIVEN TOOLS; MANIPULATORS
    • B25JMANIPULATORS; CHAMBERS PROVIDED WITH MANIPULATION DEVICES
    • B25J9/00Programme-controlled manipulators
    • B25J9/16Programme controls
    • GPHYSICS
    • G05CONTROLLING; REGULATING
    • G05BCONTROL OR REGULATING SYSTEMS IN GENERAL; FUNCTIONAL ELEMENTS OF SUCH SYSTEMS; MONITORING OR TESTING ARRANGEMENTS FOR SUCH SYSTEMS OR ELEMENTS
    • G05B19/00Programme-control systems
    • G05B19/02Programme-control systems electric
    • G05B19/04Programme control other than numerical control, i.e. in sequence controllers or logic controllers
    • GPHYSICS
    • G05CONTROLLING; REGULATING
    • G05DSYSTEMS FOR CONTROLLING OR REGULATING NON-ELECTRIC VARIABLES
    • G05D1/00Control of position, course, altitude or attitude of land, water, air or space vehicles, e.g. using automatic pilots
    • G05D1/02Control of position or course in two dimensions

Definitions

  • the present invention relates to robotics, in particular, to a method for planning the movement of a robot in the area of permissible movement on a plane, as well as to a mobile robot with the possibility of implementing this method.
  • Planning the movement of a robot is one of the main tasks of mobile robotics.
  • the goal of planning is to select trajectories that simultaneously satisfy the criteria of optimality (for example, to achieve the minimum distance and / or time of movement) and safety, i.e. to avoid collisions of the robot with obstacles.
  • Many solutions have been created in this area, including various solutions for planning the trajectories of robots in a certain area of admissible movement on a plane, for example, in a warehouse.
  • the appearance and disappearance of static obstacles is a fairly rare event.
  • the space outside this region contains with a high probability static obstacles that are constant for the environment under consideration.
  • the robot has one driving wheel or its model can be reduced to a model with one driving wheel, the slipping of which can be neglected. It is also assumed that the robot is equipped with safety sensors that check for obstacles in real time in a certain area of the field of view, determined by the angle of rotation and the speed of the drive wheel, hereinafter referred to as the "safety zone". When an obstacle is detected in the safety zone, the sensor limits the speed of the robot accordingly. Due to the fact that the number of different safety zones is finite, each of them corresponds to a range of speeds and wheel angles, and the speed limits imposed when an obstacle is detected in it correspond to the worst case. The robot is additionally equipped with sensors for preventive detection of obstacles, also operating in real time, the field of view of which exceeds the field of view of the robot's safety sensors.
  • Classical methods for planning the movement of a mobile robot are based on constructing optimal trajectories in the area of acceptable movement, for example, with using algorithms such as A * and PRM (probalistic roadmap - probabilistic road maps), taking into account the dimensions of the robot to safely avoid obstacles.
  • a * and PRM probalistic roadmap - probabilistic road maps
  • the application of this approach leads to the fact that during the planned movement, the robot may be near the border of the area of admissible movement, having a high speed. At the same time, the zones checked by the safety sensors may go beyond the border of the area of admissible movement, where the robot's safety sensors are likely to detect obstacles and limit the speed of the robot.
  • a situation similar to the one described above occurs when driving around static obstacles located near the trajectory built based on the robot’s own dimensions in the allowable movement area: the robot, approaching the obstacle at high speed, abruptly dropped it due to the operation of safety sensors.
  • a known method for planning the movement of autonomous mobile robots based on safe space (Safe Space), described in the article Park J.-H., Huh U.-Y. Path Planning for Autonomous Mobile Robot Based on Safe Space // Journal of Electrical Engineering and Technology. 2016. Vol. 11, no. 5, pp. 1441-1448. URL: https://doi.org/10.5370/JEET.2016.l L5.1441 (accessed 11/16/2020).
  • the known method is based on the definition of the state space of the robot, which includes all the kinematic states of the robot, in which planning is carried out.
  • a safe space is defined in the state space of the robot, which is defined by a set of states of the robot, in which the distance from the robot to all obstacles surrounding it is safe, i.e.
  • the distance to stop the robot is calculated taking into account the distance traveled by the robot during the time it takes to recognize an obstacle and start braking, as well as the braking distance from the start of braking to the complete stop of the robot.
  • the method takes into account the risk of hidden obstacles in areas outside the visibility of the robot's safety sensors, in particular, in areas hidden from the safety sensors by stationary obstacles. For this purpose, a risk distance is calculated corresponding to the minimum safe distance from the robot to the risk point at which an obstacle may appear.
  • areas of risk are set around stationary obstacles, which impose restrictions on the planning of the robot's movement: it is required either to limit the speed of the robot's movement, or to build a safe trajectory of the robot's movement around the risk area.
  • a globally optimal trajectory of the robot is selected using the A* algorithm with a limitation on the speed of the robot according to the cost of risk.
  • the introduction of a safe space in the described method can significantly increase the smoothness of the robot's movement, compared with the classical approach, based solely on taking into account the dimensions of the robot.
  • the introduction of risk areas around all stationary obstacles leads to non-optimal results of planning the movement of the robot, especially in the conditions of a known area of admissible movement, where the appearance and disappearance of obstacles is a rare event, thus, the known method can lead to excessive restrictions on the speed of the robot.
  • the described method is the closest solution to the claimed invention.
  • the technical problem to be solved by the invention is to plan the movement of a nonholonomic robot for some initial and final configurations of the robot within a given area of admissible movement on the plane, with the choice of globally optimal trajectories, bypassing static obstacles, and also taking into account potential speed limits, input by security sensors.
  • a method for planning the movement of a robot in the area of permissible movement on a plane includes the following stages: discretization of the state space of the robot by introducing a grid with a fixed step into the area of permissible movement and choosing a finite set of rotation angles, specifying a finite set of elementary trajectories in local coordinate system of the robot, determined by the angle of rotation of the driving wheel, its speed and duration of movement, and connecting pairs of different discrete states of the robot in the specified space, for each elementary trajectory: a safety zone is set based on the visibility zone of the robot's safety sensors at a given angle of rotation and speed of the driving wheel, a basic contour is set by combining safety zones with the dimensions of the robot, and set the contour of the elementary trajectory by combining the basic contours placed in each intermediate state of the elementary trajectory, constructing an oriented weighted multigraph without loops, the vertices of which correspond to the discrete states of the robot, the arcs correspond to the elementary traject
  • the claimed method provides a smoother and time-optimized movement of the robot.
  • the robot maintains a large distance from the border of the area of permissible movement when it develops a high speed; when moving along a narrow section, the robot deliberately reduces speed; turns at "crossroads", at the boundaries of the zone of permissible movement, the robot performs more smoothly and at high speed.
  • the claimed method further comprises a step in which the basic contour of each elementary trajectory is expanded by the amount of the error in the movement of the robot along the trajectory.
  • the claimed method further comprises the steps of: moving the robot according to the selected sequence of elementary trajectories and their speeds, checking the area surrounding the robot for the presence of static obstacles in real time using preventive obstacle detection sensors, checking the contours of the selected sequence of elementary trajectories for the presence of intersection with the detected static obstacles, and in the presence of the specified intersection, a new sequence of elementary trajectories is determined for the movement of the robot to the target state by searching in the constructed multigraph for a new path with the smallest sum of weights, while all arcs, contours of elementary trajectories are excluded from the search which intersect with the detected static obstacles, and the search of multiple arcs is carried out in ascending order of weight, until the arc is detected, the contour of the elementary trajectory which does not intersect with the detected static obstacles.
  • the invention in the embodiment described above makes it possible to rebuild the trajectory of the robot in case of detection of obstacles by sensors of preventive obstacle detection. Rebuilding is performed on the basis of the same multigraph built earlier, which significantly reduces computational costs and increases the speed of rebuilding.
  • the field of view of the robot's preventive obstacle detection sensors exceeds the field of view of the robot's safety sensors, so that the definition of a new sequence of elementary trajectories for the robot to move to the target state due to the detection of a static obstacle by the preventive obstacle detection sensors is carried out without limiting the speed of the robot.
  • the difference between the visibility areas of the sensors for preventive detection of obstacles and the safety sensors can be selected based on the maximum speed of the robot, so that in all cases the trajectory is rebuilt before the safety sensors are triggered and, accordingly, the speed of the robot is limited.
  • the invention makes it possible to rebuild the trajectory of the robot in real time and without reducing the speed of the robot.
  • a mobile robot containing: a chassis with a drive wheel to ensure the movement of the robot with a given speed range, safety sensors to detect obstacles in the field of view of the safety sensors surrounding the robot, and a control system communicatively connected with the safety sensors, made with the ability to scheduling the movement of the robot in the area of allowed movement on the plane according to the method described above, and controlling the chassis to carry out the movement of the robot.
  • a smoother and time-optimized movement of the claimed mobile robot is provided.
  • the mobile robot comprises proactive obstacle detection sensors communicatively coupled to the control system to detect obstacles in a field of view of the proactive obstacle detection sensors surrounding the robot that exceeds the field of view of the safety sensors of the robot.
  • the control system of the robot can be configured to plan the movement of the robot in the area of allowable movement on the plane according to the embodiments of the claimed method, which provides for checking the area surrounding the robot for the presence of static obstacles using preventive obstacle detection sensors. Accordingly, the invention makes it possible to rebuild the trajectory of the mobile robot in real time and without reducing the speed of movement.
  • the mobile robot can be used to solve various kinds of problems, in particular, to solve warehouse logistics problems, and can be a robotic stacker, reach truck, tractor, warehouse cart, etc. and.
  • FIG. 1 shows a robotic electric stacker in which the present invention may be implemented.
  • FIG. 2 is a schematic representation of a stacker robot in which the present invention is implemented, global and local coordinate systems.
  • Fig.3 set of rotation angles of the robot stacker, given according to the invention.
  • Fig.4 is an example of an elementary trajectory traversed by the reference point of the local coordinate system at a fixed angle of rotation of the drive wheel of the stacker robot.
  • 5 is an exemplary selection of a plurality of elementary trajectories of a stacking robot according to the invention.
  • Fig.b is an example of a set of contours of elementary trajectories that connect the same initial and final states, but corresponding to different speeds of the stacker robot.
  • Fig.7 another example of a set of contours of elementary trajectories, linking the same initial and final states, but corresponding to different speeds of the stacker robot.
  • Fig.8 the result of planning the movement of the stacker robot in the area of admissible movement in the classical way, based on the dimensions of the robot, without taking into account the contours of the elementary trajectories.
  • Fig. 9 is a result of motion planning of the stacker robot in the allowable motion area of Fig. 8 according to an embodiment of the invention.
  • Fig.10 the result of planning the movement of the stacker robot in the area of admissible movement in the classical way, based on the dimensions of the robot, without taking into account the contours of elementary trajectories, in case of detection of static obstacles.
  • Fig. 11 is a result of motion planning of the stacking robot in the allowable motion area of Fig. 10 according to an embodiment of the invention.
  • the invention is aimed at optimizing the planning of the movement of a robot equipped with safety sensors and sensors for preventive obstacle detection in the area of permissible movement on a plane.
  • the appearance and disappearance of static obstacles is considered a rare event.
  • the concept of the area of permissible movement is applicable, for example, to a warehouse with a known geometry, as well as to many other spaces, subject to measurement and control.
  • the space outside the area of admissible movement contains with a high probability static obstacles that are constant for the considered environment.
  • robot has one drive wheel, the slip of which can be neglected.
  • An example of such a robot is the robotic electric stacker 1 shown in FIG. 1, in which the present invention has been implemented.
  • robot mobile robot
  • stacker robot stacker
  • the invention is not limited in this regard and can be successfully implemented on the basis of any mobile robot, the kinematic model of which is reducible to the kinematic model of a robot with one driving wheel, in particular, in various robotic warehouse vehicles, such as tractor, storage trolley, reach truck, etc. .
  • the safety sensors 2 of the robot check in real time the presence of obstacles in a certain area of visibility, determined by the angle of rotation and the speed of the drive wheel 3, called the safety zone. When an obstacle is detected in the safety zone, the safety sensor limits the speed of the robot accordingly.
  • Proactive obstacle detection sensors 4 robots also work in real time and have areas of view that exceed those of safety sensors.
  • the sensor part of the sensor system of preventive obstacle detection 4 can be at least partially combined with the sensor part of the safety sensor system 2, provided that each of the safety sensor systems and preventive detection of obstacles has its own data processing subsystems and executive mechanisms.
  • the position of the robot on the plane hereinafter referred to as the state of the robot can be represented by three values: displacement and rotation of the reference point of the local coordinate system relative to the global one.
  • the set of all possible states of the robot in the area of permissible movement forms the state space of the robot.
  • the robot has one drive wheel or can be represented by a kinematic model with one drive wheel, the range of possible rotation angles is known, as well as the range of possible speeds.
  • the discrete state of the robot is represented by the indices of the nearest grid vertex in the area of permissible movement and the index of the nearest rotation angle.
  • Corresponding trajectories traversed by the point of reference of the robot's local coordinate system consist of line segments, circular arcs and turning points in place.
  • Each separate section of such a trajectory is determined by three parameters: the angle of rotation of the drive wheel, its speed, and the duration of movement.
  • An example of an elementary trajectory 6, which is a path traversed by the reference point of the local coordinate system for a certain period of time at a fixed angle of rotation 7 and the speed V of the drive wheel 3 of the stacker robot 1 is shown in Fig.4.
  • a finite set of elementary trajectories are set with sufficient accuracy connecting pairs of different discrete states of the robot in the state space of the robot.
  • Fig.5 you can see an example of a selection from the set of elementary trajectories 8 of the robot stacker 1.
  • a safety zone is set based on the field of view of the robot's safety sensors. given the angle of rotation and the speed of the drive wheel.
  • a basic contour is set, which is a combination of safety zones with the dimensions of the robot.
  • the contour of the elementary trajectory is set, which is the union of the basic contours placed in each intermediate state of the elementary trajectory.
  • contour 9 marked with triangles, corresponds to the speed of the stacker robot in 0.3 m/s; contour 10, marked with square signs, corresponds to a speed of 0.7 m/s; contour 11, marked with a straight cross, corresponds to a speed of 1.0 m/s; contour 12, marked with diamond signs, corresponds to a speed of 1.38 m/s; and contour 13, marked with signs of an inclined cross, corresponds to a speed of 1.67 m/s.
  • the basic contour of each elementary trajectory is expanded by the amount of such an error.
  • the invention can be used, among other things, for planning the movement of the robot in open spaces where slippage of the driving wheel of the robot is possible.
  • the given area of allowed movement of the robot in the global coordinate system can be represented, for example, by a set of flat polygons. This area is fixed, and to take into account the possibility of short-term occurrence of obstacles in it, data from sensors of preventive obstacle detection is used.
  • an oriented weighted multigraph without loops is built once, hereinafter referred to simply as a multigraph for brevity, the vertices of which correspond to the discrete states of the robot, and the arcs correspond to elementary trajectories.
  • the multigraph includes only those arcs whose elementary trajectory contours lie completely in the region of admissible motion, as well as only those vertices from which at least one arc originates.
  • the weights of the arcs the time of movement along elementary trajectories is used.
  • the path in the multigraph with the smallest sum of weights on the arcs will allow reaching the target state in least time.
  • the robot motion planning method of the present invention comprises determining a sequence of elementary trajectories for the robot to move to a target state by searching the constructed multigraph for the path with the smallest sum of weights.
  • Pathfinding in a multigraph can be performed using various well-known algorithms such as A*, D*, RTAA*, LSS-LRTA*, etc.
  • the invention is not limited to an algorithm for finding a path in a multigraph, and any appropriate algorithm, including including algorithms that may be developed in the future, can be successfully applied in all embodiments of the present invention.
  • arcs in the multigraph correspond to elementary trajectories with the same angle of rotation of the drive wheel and the same length, but different speeds and different travel times, i.e. different weight. It is obvious that the arc with the highest speed (least weight) will be the most preferable among all multiple arcs, however, since it also corresponds to the largest contour, it can be excluded from consideration in the process of rebuilding the path during the movement of the robot, if it is found to intersect with such obstacle outline.
  • the method additionally comprises the steps of: moving the robot according to the selected sequence of elementary trajectories and their speeds, and in real time checking the area surrounding the robot for the presence of static obstacles using preventive obstacle detection sensors.
  • the contours of the selected sequence of elementary trajectories are checked for the presence of intersection with the detected static obstacles, and in the presence of the specified intersection, a new sequence of elementary trajectories is determined for the robot to move to the target state by searching in the constructed multigraph for a new path with the smallest sum of weights, while all arcs are excluded from the search, the contours of the elementary trajectories of which intersect with the detected static obstacles, and the enumeration of multiple arcs is carried out in order of increasing weight, until an arc is found, the contour of the elementary trajectory of which does not intersect with the detected static obstacles.
  • the field of view of the robot's preventive obstacle detection sensors which exceeds the field of view of the robot's safety sensors, based on the indications of which the robot's speed can be limited, is selected in such a way that the definition of a new sequence of elementary trajectories for the robot to move to the target state due to the detection of a static obstacle by sensors, preventive obstacle detection is carried out without limiting the speed of the robot.
  • the difference in the field of view of the preventive obstacle detection sensors and the safety sensors of the robot is selected so that after the preventive obstacle detection sensors are triggered, the robot has time to rebuild and change the movement trajectory before the safety sensors are triggered, even in the case of movement at maximum speed.
  • the invention was implemented in the hardware and software system of the robotic electric stacker 1 shown in Fig.1.
  • the specified stacker 1 is a mobile robot, which is a separate object of the present invention.
  • the implementation of the invention based on the stacker robot 1 is described below in detail to provide an understanding of the essence of the invention.
  • all technical details, meanings and values presented are merely examples of one or more embodiments of the invention, and in no way limit the scope of the legal protection provided by the claims.
  • the stacker robot 1 is equipped with two laser scanners located in its front part on the sides and combining the functions of the sensor part of the safety sensors 2 and sensors of preventive obstacle detection 4.
  • Combining the sensor part of safety sensors and preventive obstacle detection is preferable to increase the compactness and reduce the cost of the robot equipment, but is not the only possible solution.
  • safety sensors and sensors for preventive obstacle detection can be implemented as separate devices or modules.
  • the stacker robot 1 has one driving wheel 3, its rotation angle (p lies in the range of [-90, 90] degrees, and the linear speed V lies in the range of [-0.3, 1.67] m/s, for example, as shown in Fig. 4.
  • the wheelbase L is 1.386 m.
  • a grid was introduced with a step of 0.1 m along the axes OX and OY of the global coordinate system shown in Fig.2, and also fixed set 5 of 24 rotation angles of the driving wheel 3 of the robot, shown in Fig.Z.
  • a set of 918 elementary trajectories was recorded, a sample of 8 of which is shown in Fig.5 for example.
  • the invention is not limited in respect of all the specified parameters, the grid spacing, the number of discrete rotation angles and elementary trajectories of the robot can be specified differently, depending on the conditions of the problem being solved, the required accuracy, available computing power, etc.
  • Figures b and 7 show examples of the contours of elementary trajectories calculated for the stacker robot 1: in each case, a set of contours of the elementary trajectory 9, 10, 11, 12 and 13 is shown, linking the same initial and final states, but corresponding to different speeds of the robot, from 0.3 m/s to 1.67 m/s, as mentioned above.
  • the movement of the stacker 1 was planned in various areas of permissible movement by the method according to the embodiments of the invention, as well as by the classical method, without taking into account the safety zones and contours of the elementary trajectories described above, which allows comparing the planning results.
  • Figure 8 shows an example of planning the movement of the stacker robot 1 from point A to point B in a given area of permissible movement with boundaries 15 in the classical way, based on the dimensions of the stacker robot 1.
  • Figure 9 shows the result of applying an embodiment of the present invention for planning movement of the robot stacker 1 under conditions similar to those shown in Fig.8.
  • Another example of planning the movement of the robot stacker 1 in the classical way is shown in Fig.10, in this case, static obstacles 16 are detected during the movement of the robot in the area of permissible movement.
  • FIG. 11 shows the result of applying an embodiment of the present invention to planning the motion of a stacking robot 1 under conditions similar to those shown in FIG. 10.
  • FIG. 10 shows the result of applying an embodiment of the present invention to planning the motion of a stacking robot 1 under conditions similar to those shown in FIG. 10.

Landscapes

  • Engineering & Computer Science (AREA)
  • Robotics (AREA)
  • Mechanical Engineering (AREA)
  • Physics & Mathematics (AREA)
  • General Physics & Mathematics (AREA)
  • Automation & Control Theory (AREA)
  • Aviation & Aerospace Engineering (AREA)
  • Radar, Positioning & Navigation (AREA)
  • Remote Sensing (AREA)
  • Control Of Position, Course, Altitude, Or Attitude Of Moving Bodies (AREA)

Abstract

A method for planning the motion of a robot in an area of permissible motion on a surface includes discretizing the state space of a robot and determining a finite set of elementary trajectories connecting pairs of states of the robot. For each elementary trajectory, the following is determined: a safe zone based on the visibility of safety sensors, a basic outline combining the safe zone with the dimensions of the robot, and an elementary trajectory outline combining the basic outlines of each intermediate state of a trajectory. A directed weighted multigraph is then constructed without loops, where the vertices correspond to discrete states of the robot, the arcs correspond to elementary trajectories lying in the area of permissible motion, and the weight of an arc corresponds to the time of travel along a trajectory, and the motion of the robot is planned by searching the multigraph for the path having the lowest sum of weights. This increases fluidity of motion and reduces the travel time of the robot along its course.

Description

СПОСОБ ПЛАНИРОВАНИЯ ДВИЖЕНИЯ РОБОТА И МОБИЛЬНЫЙ РОБОТ ROBOT PLANNING METHOD AND MOBILE ROBOT
ОБЛАСТЬ ТЕХНИКИ, К КОТОРОЙ ОТНОСИТСЯ ИЗОБРЕТЕНИЕFIELD OF TECHNOLOGY TO WHICH THE INVENTION RELATES
Настоящее изобретение относится к робототехнике, в частности, к способу планирования движения робота в области допустимого движения на плоскости, а также к мобильному роботу с возможностью осуществления данного способа. The present invention relates to robotics, in particular, to a method for planning the movement of a robot in the area of permissible movement on a plane, as well as to a mobile robot with the possibility of implementing this method.
УРОВЕНЬ ТЕХНИКИ BACKGROUND OF THE INVENTION
Планирование движения робота является одной из основных задач мобильной робототехники. Целью планирования является выбор траекторий, удовлетворяющих одновременно критериям оптимальности (например, для достижения минимального расстояния и/или времени движения) и безопасности, т.е. позволяющих избежать столкновений робота с препятствиями. В этой области создано множество решений, включая различные решения по планированию траекторий движения роботов в некоторой области допустимого движения на плоскости, например, на территории складского помещения. В рамках области допустимого движения появление и исчезновение статических препятствий является достаточно редким событием. В свою очередь, пространство вне этой области с большой вероятностью содержит статические препятствия, являющиеся постоянными для рассматриваемого окружения. Planning the movement of a robot is one of the main tasks of mobile robotics. The goal of planning is to select trajectories that simultaneously satisfy the criteria of optimality (for example, to achieve the minimum distance and / or time of movement) and safety, i.e. to avoid collisions of the robot with obstacles. Many solutions have been created in this area, including various solutions for planning the trajectories of robots in a certain area of admissible movement on a plane, for example, in a warehouse. Within the limits of the area of permissible movement, the appearance and disappearance of static obstacles is a fairly rare event. In turn, the space outside this region contains with a high probability static obstacles that are constant for the environment under consideration.
Предполагается, что робот имеет одно ведущее колесо или его модель может быть сведена к модели с одним ведущим колесом, проскальзыванием которого можно пренебречь. Также предполагается, что робот оснащен датчиками безопасности, которые в режиме реального времени проверяют наличие препятствий в некоторой зоне области видимости, определяемой углом поворота и скоростью ведущего колеса, далее называемой «зоной безопасности». При обнаружении препятствия в зоне безопасности датчик соответствующим образом ограничивает скорость движения робота. В связи с тем, что количество различных зон безопасности конечно, каждая из них соответствует диапазону скоростей и углов поворота колеса, а вводимые при обнаружении в ней препятствия ограничения скорости соответствуют наихудшему случаю. Робот дополнительно оснащен датчиками превентивного обнаружения препятствий, также работающими в режиме реального времени, области видимости которых превосходят области видимости датчиков безопасности робота. It is assumed that the robot has one driving wheel or its model can be reduced to a model with one driving wheel, the slipping of which can be neglected. It is also assumed that the robot is equipped with safety sensors that check for obstacles in real time in a certain area of the field of view, determined by the angle of rotation and the speed of the drive wheel, hereinafter referred to as the "safety zone". When an obstacle is detected in the safety zone, the sensor limits the speed of the robot accordingly. Due to the fact that the number of different safety zones is finite, each of them corresponds to a range of speeds and wheel angles, and the speed limits imposed when an obstacle is detected in it correspond to the worst case. The robot is additionally equipped with sensors for preventive detection of obstacles, also operating in real time, the field of view of which exceeds the field of view of the robot's safety sensors.
Классические способы планирования движения мобильного робота основаны на построении в области допустимого движения оптимальных траекторий, например, с помощью таких алгоритмов, как А* и PRM (probalistic roadmap - вероятностные дорожные карты), с учетом габаритов робота для безопасного обхода препятствий. Classical methods for planning the movement of a mobile robot are based on constructing optimal trajectories in the area of acceptable movement, for example, with using algorithms such as A * and PRM (probalistic roadmap - probabilistic road maps), taking into account the dimensions of the robot to safely avoid obstacles.
Однако применение такого подхода приводит к тому, что в ходе запланированного движения робот может оказаться вблизи границы области допустимого движения, имея большую скорость. При этом зоны, проверяемые датчиками безопасности, могут выходить за границу области допустимого движения, где датчики безопасности робота с большой вероятностью обнаружат препятствия и ограничат скорость движения робота. However, the application of this approach leads to the fact that during the planned movement, the robot may be near the border of the area of admissible movement, having a high speed. At the same time, the zones checked by the safety sensors may go beyond the border of the area of admissible movement, where the robot's safety sensors are likely to detect obstacles and limit the speed of the robot.
Ситуация, аналогичная вышеописанной, происходит при объезде статических препятствий, расположенных вблизи построенной исходя из собственных габаритов робота траектории в допустимой области движения: робот, приближаясь к препятствию на большой скорости, резко сбрасывал её вследствие срабатывания датчиков безопасности. A situation similar to the one described above occurs when driving around static obstacles located near the trajectory built based on the robot’s own dimensions in the allowable movement area: the robot, approaching the obstacle at high speed, abruptly dropped it due to the operation of safety sensors.
Подобные решения, основанные на классическом методе учета габаритов робота при планировании траектории, имеют несколько недостатков: во-первых, отсутствие учета снижения скорости на этапе выбора траектории движения приводит к нахождению неоптимальных по времени решений; во-вторых, движение робота перестает быть плавным из-за частого сброса и набора скорости. Последний недостаток может быть особенно неблагоприятным для складских роботов, перевозящих грузы, часто незакрепленные, которые могут смещаться и даже падать с грузовой платформы при торможении и ускорении робота. Such solutions, based on the classical method of taking into account the dimensions of the robot when planning the trajectory, have several disadvantages: firstly, the lack of consideration for the decrease in speed at the stage of choosing the trajectory of motion leads to finding solutions that are not optimal in time; secondly, the movement of the robot ceases to be smooth due to frequent reset and acceleration. The latter drawback can be particularly disadvantageous for warehouse robots carrying loads, often loose ones, that can shift and even fall off the loading platform when the robot brakes and accelerates.
Известен способ планирования движения автономных мобильных роботов на основе безопасного пространства (Safe Space), описанный в статье Park J.-H., Huh U.-Y. Path Planning for Autonomous Mobile Robot Based on Safe Space // Journal of Electrical Engineering and Technology. 2016. Vol. 11, No. 5, стр. 1441-1448. URL: https://doi.org/10.5370/JEET.2016.l L5.1441 (дата обращения 16.11.2020). Известный способ основан на определении пространства состояний робота, включающего в себя все кинематические состояния робота, в котором и осуществляют планирование. Для этой цели в пространстве состояний робота определяют безопасное пространство, задаваемое совокупностью состояний робота, в которых расстояние от робота до всех окружающих его препятствий является безопасным, т.е. включает в себя минимальное расстояние, необходимое для остановки робота до его столкновения с препятствием, с учетом ограниченной области видимости датчиков безопасности робота. Расстояние до остановки робота рассчитывается с учетом дистанции, проходимой роботом за время, требующееся ему для распознавания препятствия и начала торможения, а также величины тормозного пути, от начала торможения до полной остановки робота. Кроме того, способ учитывает риск наличия скрытых препятствий в областях вне зоны видимости датчиков безопасности робота, в частности, в областях, скрытых от датчиков безопасности стационарными препятствиями. Для этой цели вычисляется дистанция риска, соответствующая минимальному безопасному расстоянию от робота до точки риска, в которой возможно появление препятствия. Таким образом, вокруг стационарных препятствий задают области риска, накладывающие ограничения на планирование движения робота: требуется либо ограничить скорость движения робота, либо построить безопасную траекторию движения робота в обход области риска. Далее в известном способе осуществляют выбор глобально оптимальной траектории движения робота с помощью алгоритма А* с ограничением скорости движения робота по стоимости риска. A known method for planning the movement of autonomous mobile robots based on safe space (Safe Space), described in the article Park J.-H., Huh U.-Y. Path Planning for Autonomous Mobile Robot Based on Safe Space // Journal of Electrical Engineering and Technology. 2016. Vol. 11, no. 5, pp. 1441-1448. URL: https://doi.org/10.5370/JEET.2016.l L5.1441 (accessed 11/16/2020). The known method is based on the definition of the state space of the robot, which includes all the kinematic states of the robot, in which planning is carried out. For this purpose, a safe space is defined in the state space of the robot, which is defined by a set of states of the robot, in which the distance from the robot to all obstacles surrounding it is safe, i.e. includes the minimum distance required to stop the robot before it collides with an obstacle, taking into account the limited field of view of the robot's safety sensors. The distance to stop the robot is calculated taking into account the distance traveled by the robot during the time it takes to recognize an obstacle and start braking, as well as the braking distance from the start of braking to the complete stop of the robot. In addition, the method takes into account the risk of hidden obstacles in areas outside the visibility of the robot's safety sensors, in particular, in areas hidden from the safety sensors by stationary obstacles. For this purpose, a risk distance is calculated corresponding to the minimum safe distance from the robot to the risk point at which an obstacle may appear. Thus, areas of risk are set around stationary obstacles, which impose restrictions on the planning of the robot's movement: it is required either to limit the speed of the robot's movement, or to build a safe trajectory of the robot's movement around the risk area. Further, in a known method, a globally optimal trajectory of the robot is selected using the A* algorithm with a limitation on the speed of the robot according to the cost of risk.
Введение безопасного пространства в описанном способе позволяет значительно увеличить плавность движения робота, по сравнению с классическим подходом, основанном исключительно на учете габаритов робота. Однако введение областей риска вокруг всех стационарных препятствий приводит к неоптимальным результатам планирования движения робота, особенно в условиях известной области допустимого движения, где появление и исчезновение препятствий является редким событием, таким образом, известный способ может приводить к избыточным ограничениям скорости движения робота. Вместе с тем описанный способ является наиболее близким решением к заявленному изобретению. The introduction of a safe space in the described method can significantly increase the smoothness of the robot's movement, compared with the classical approach, based solely on taking into account the dimensions of the robot. However, the introduction of risk areas around all stationary obstacles leads to non-optimal results of planning the movement of the robot, especially in the conditions of a known area of admissible movement, where the appearance and disappearance of obstacles is a rare event, thus, the known method can lead to excessive restrictions on the speed of the robot. However, the described method is the closest solution to the claimed invention.
Техническая проблема, на решение которой направлено изобретение, заключается в планировании движения неголономного робота для некоторых начальной и конечной конфигураций робота в рамках заданной области допустимого движения на плоскости, с выбором глобально оптимальных траекторий, объездом статических препятствий, а также с учетом потенциально возможных ограничений скорости, вводимых датчиками безопасности. The technical problem to be solved by the invention is to plan the movement of a nonholonomic robot for some initial and final configurations of the robot within a given area of admissible movement on the plane, with the choice of globally optimal trajectories, bypassing static obstacles, and also taking into account potential speed limits, input by security sensors.
РАСКРЫТИЕ СУЩНОСТИ ИЗОБРЕТЕНИЯ DISCLOSURE OF THE INVENTION
Для решения поставленной проблемы предложен способ планирования движения робота в области допустимого движения на плоскости, содержащий этапы, на которых: осуществляют дискретизацию пространства состояний робота посредством введения в области допустимого движения сетки с фиксированным шагом и выбора конечного множества углов поворота, задают конечное множество элементарных траекторий в локальной системе координат робота, определяемых углом поворота ведущего колеса, его скоростью и длительностью движения, и соединяющих пары различных дискретных состояний робота в указанном пространстве, для каждой элементарной траектории: задают зону безопасности на основании зоны видимости датчиков безопасности робота при данных угле поворота и скорости движения ведущего колеса, задают базовый контур посредством объединения зон безопасности с габаритами робота, и задают контур элементарной траектории посредством объединения базовых контуров, помещенных в каждое промежуточное состояние элементарной траектории, строят ориентированный взвешенный мультиграф без петель, вершины которого соответствуют дискретным состояниям робота, дуги соответствуют элементарным траекториям, а вес дуги соответствует времени движения робота по элементарной траектории, причем в граф включают лишь дуги, контуры элементарных траекторий которых полностью лежат в заданной области допустимого движения, и лишь те вершины, из которых исходит хотя бы одна дуга, и определяют последовательность элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе пути с наименьшей суммой весов. To solve this problem, a method for planning the movement of a robot in the area of permissible movement on a plane is proposed, which includes the following stages: discretization of the state space of the robot by introducing a grid with a fixed step into the area of permissible movement and choosing a finite set of rotation angles, specifying a finite set of elementary trajectories in local coordinate system of the robot, determined by the angle of rotation of the driving wheel, its speed and duration of movement, and connecting pairs of different discrete states of the robot in the specified space, for each elementary trajectory: a safety zone is set based on the visibility zone of the robot's safety sensors at a given angle of rotation and speed of the driving wheel, a basic contour is set by combining safety zones with the dimensions of the robot, and set the contour of the elementary trajectory by combining the basic contours placed in each intermediate state of the elementary trajectory, constructing an oriented weighted multigraph without loops, the vertices of which correspond to the discrete states of the robot, the arcs correspond to the elementary trajectories, and the weight of the arc corresponds to the time the robot moves along the elementary trajectory, and in the graph includes only arcs, the contours of the elementary trajectories of which lie completely in the given area of admissible motion, and only those vertices from which at least one arc proceeds, and determine the sequence of elementary paths thorium for moving the robot to the target state by searching the constructed multigraph for the path with the smallest sum of weights.
Благодаря описанному подходу к введению и учету зон безопасности, заявленный способ обеспечивает более плавное и оптимальное по времени движение робота. В частности, при использовании изобретения достигаются следующие эффекты: робот сохраняет большую дистанцию от границы области допустимого движения, когда развивает большую скорость; при движении по узкому участку робот запланировано снижает скорость; повороты на «перекрестках», у границ зоны допустимого движения, робот осуществляет более плавно и на большой скорости. Thanks to the described approach to the introduction and consideration of safety zones, the claimed method provides a smoother and time-optimized movement of the robot. In particular, when using the invention, the following effects are achieved: the robot maintains a large distance from the border of the area of permissible movement when it develops a high speed; when moving along a narrow section, the robot deliberately reduces speed; turns at "crossroads", at the boundaries of the zone of permissible movement, the robot performs more smoothly and at high speed.
Согласно варианту осуществления изобретения, заявленный способ дополнительно содержит этап, на котором базовый контур каждой элементарной траектории расширяют на величину погрешности движения робота по траектории. Это позволяет учесть погрешность движения робота вдоль выбранной траектории, если погрешность присутствует и не превышает некоторую пороговую величину. Например, таким образом можно учесть погрешность, вносимую проскальзыванием ведущего колеса робота, или погрешности, вносимые системой позиционирования. Согласно следующему варианту осуществления изобретения, заявленный способ дополнительно содержит этапы, на которых: осуществляют движение робота согласно выбранной последовательности элементарных траекторий и их скоростей, в режиме реального времени осуществляют проверку окружающей робота области на наличие статических препятствий с помощью датчиков превентивного обнаружения препятствий, проверяют контуры выбранной последовательности элементарных траекторий на наличие пересечения с обнаруженными статическими препятствиями, и при наличии указанного пересечения определяют новую последовательность элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе нового пути с наименьшей суммой весов, при этом из поиска исключают все дуги, контуры элементарных траекторий которых пересекаются с обнаруженными статическими препятствиями, а перебор кратных дуг осуществляют в порядке возрастания веса, до обнаружения дуги, контур элементарной траектории которой не пересекается с обнаруженными статическими препятствиями. According to an embodiment of the invention, the claimed method further comprises a step in which the basic contour of each elementary trajectory is expanded by the amount of the error in the movement of the robot along the trajectory. This makes it possible to take into account the error of the robot's movement along the selected trajectory, if the error is present and does not exceed a certain threshold value. For example, in this way it is possible to take into account the error introduced by the slippage of the driving wheel of the robot, or the errors introduced by the positioning system. According to the following embodiment of the invention, the claimed method further comprises the steps of: moving the robot according to the selected sequence of elementary trajectories and their speeds, checking the area surrounding the robot for the presence of static obstacles in real time using preventive obstacle detection sensors, checking the contours of the selected sequence of elementary trajectories for the presence of intersection with the detected static obstacles, and in the presence of the specified intersection, a new sequence of elementary trajectories is determined for the movement of the robot to the target state by searching in the constructed multigraph for a new path with the smallest sum of weights, while all arcs, contours of elementary trajectories are excluded from the search which intersect with the detected static obstacles, and the search of multiple arcs is carried out in ascending order of weight, until the arc is detected, the contour of the elementary trajectory which does not intersect with the detected static obstacles.
Изобретение в описанном выше варианте осуществления, позволяет перестроить траекторию движения робота в случае обнаружения препятствий датчиками превентивного обнаружения препятствий. Перестроение выполняется на основе того же, построенного ранее мультиграфа, что существенно снижает вычислительные затраты и увеличивает скорость перестроения. The invention in the embodiment described above makes it possible to rebuild the trajectory of the robot in case of detection of obstacles by sensors of preventive obstacle detection. Rebuilding is performed on the basis of the same multigraph built earlier, which significantly reduces computational costs and increases the speed of rebuilding.
Согласно дополнительному варианту осуществления изобретения, область видимости датчиков превентивного обнаружения препятствий робота превышает область видимости датчиков безопасности робота, так что определение новой последовательности элементарных траекторий для движения робота в целевое состояние из-за обнаружения статического препятствия датчиками превентивного обнаружения препятствий осуществляют без ограничения скорости движения робота. According to an additional embodiment of the invention, the field of view of the robot's preventive obstacle detection sensors exceeds the field of view of the robot's safety sensors, so that the definition of a new sequence of elementary trajectories for the robot to move to the target state due to the detection of a static obstacle by the preventive obstacle detection sensors is carried out without limiting the speed of the robot.
Разность областей видимости датчиков превентивного обнаружения препятствий и датчиков безопасности может выбираться исходя из максимальной скорости робота, так чтобы во всех случаях перестроение траектории происходило до срабатывания датчиков безопасности и соответственно ограничения скорости робота. Таким образом, изобретение позволяет перестроить траекторию движения робота в режиме реального времени и без снижения скорости движения робота. Решение поставленной проблемы также достигнуто с помощью мобильного робота, содержащего: шасси с ведущим колесом для обеспечения движения робота с заданным диапазоном скоростей, датчики безопасности для обнаружения препятствий в окружающей робота области видимости датчиков безопасности, и коммуникативно связанную с датчиками безопасности систему управления, выполненную с возможностью планирования движения робота в области допустимого движения на плоскости согласно описанному выше способу, и управления шасси для осуществления движения робота. The difference between the visibility areas of the sensors for preventive detection of obstacles and the safety sensors can be selected based on the maximum speed of the robot, so that in all cases the trajectory is rebuilt before the safety sensors are triggered and, accordingly, the speed of the robot is limited. Thus, the invention makes it possible to rebuild the trajectory of the robot in real time and without reducing the speed of the robot. The solution to the problem was also achieved with the help of a mobile robot containing: a chassis with a drive wheel to ensure the movement of the robot with a given speed range, safety sensors to detect obstacles in the field of view of the safety sensors surrounding the robot, and a control system communicatively connected with the safety sensors, made with the ability to scheduling the movement of the robot in the area of allowed movement on the plane according to the method described above, and controlling the chassis to carry out the movement of the robot.
Согласно изобретению, обеспечивается более плавное и оптимальное по времени движение заявленного мобильного робота. According to the invention, a smoother and time-optimized movement of the claimed mobile robot is provided.
В дополнительном варианте осуществления мобильный робот содержит коммуникативно связанные с системой управления датчики превентивного обнаружения препятствий для обнаружения препятствий в окружающей робота области видимости датчиков превентивного обнаружения препятствий, превышающей область видимости датчиков безопасности робота. При этом система управления робота может быть выполнена с возможностью планирования движения робота в области допустимого движения на плоскости согласно вариантам осуществления заявленного способа, предусматривающим проверку окружающей робота области на наличие статических препятствий с помощью датчиков превентивного обнаружения препятствий. Соответственно, изобретение позволяет перестроить траекторию движения мобильного робота в режиме реального времени и без снижения скорости движения. In a further embodiment, the mobile robot comprises proactive obstacle detection sensors communicatively coupled to the control system to detect obstacles in a field of view of the proactive obstacle detection sensors surrounding the robot that exceeds the field of view of the safety sensors of the robot. At the same time, the control system of the robot can be configured to plan the movement of the robot in the area of allowable movement on the plane according to the embodiments of the claimed method, which provides for checking the area surrounding the robot for the presence of static obstacles using preventive obstacle detection sensors. Accordingly, the invention makes it possible to rebuild the trajectory of the mobile robot in real time and without reducing the speed of movement.
Наконец, изобретение предусматривает, что во всех вариантах осуществления мобильный робот может быть использован для решения разного рода задач, в частности, для решения задач складской логистики, и может представлять собой роботизированный штабелер, ричтрак, тягач, складскую тележку и т. и. Finally, the invention provides that in all embodiments, the mobile robot can be used to solve various kinds of problems, in particular, to solve warehouse logistics problems, and can be a robotic stacker, reach truck, tractor, warehouse cart, etc. and.
Каждый из описанных выше вариантов осуществления изобретения обеспечивает возможность достижения технического результата, заключающегося в оптимизации планирования движения неголономного робота для некоторых начальной и конечной конфигураций робота в рамках заданной области допустимого движения на плоскости, в том числе, посредством увеличения плавности движения и уменьшения времени движения робота по маршруту. Each of the embodiments of the invention described above makes it possible to achieve a technical result, which consists in optimizing the motion planning of a nonholonomic robot for some initial and final robot configurations within a given area of admissible movement on a plane, including by increasing the smoothness of movement and reducing the time of movement of the robot along route.
КРАТКОЕ ОПИСАНИЕ ЧЕРТЕЖЕЙ BRIEF DESCRIPTION OF THE DRAWINGS
Сущность изобретения поясняется ниже на примере некоторых вариантов его осуществления со ссылкой на чертежи, содержащие следующие иллюстрации. Фиг.1 - изображение роботизированного электрического штабелера, в котором может быть реализовано настоящее изобретение. The essence of the invention is explained below on the example of some variants of its implementation with reference to the drawings containing the following illustrations. 1 shows a robotic electric stacker in which the present invention may be implemented.
Фиг.2 - схематичное изображение робота-штабелера, в котором реализовано настоящее изобретение, глобальной и локальной систем координат. 2 is a schematic representation of a stacker robot in which the present invention is implemented, global and local coordinate systems.
Фиг.З - множество углов поворота робота-штабелера, заданное согласно изобретению. Fig.3 - set of rotation angles of the robot stacker, given according to the invention.
Фиг.4 - пример элементарной траектории, проходимой точкой отсчета локальной системы координат при фиксированном угле поворота ведущего колеса робота-штабелера. Fig.4 is an example of an elementary trajectory traversed by the reference point of the local coordinate system at a fixed angle of rotation of the drive wheel of the stacker robot.
Фиг.5 - примерная выборка из множества элементарных траекторий робота- штабелера согласно изобретению. 5 is an exemplary selection of a plurality of elementary trajectories of a stacking robot according to the invention.
Фиг.б - пример набора контуров элементарных траекторий, связывающих одни и те же начальное и конечное состояния, но соответствующих разным скоростям движения робота-штабелера. Fig.b is an example of a set of contours of elementary trajectories that connect the same initial and final states, but corresponding to different speeds of the stacker robot.
Фиг.7 - другой пример набора контуров элементарных траекторий, связывающих одни и те же начальное и конечное состояния, но соответствующих разным скоростям движения робота-штабелера. Fig.7 - another example of a set of contours of elementary trajectories, linking the same initial and final states, but corresponding to different speeds of the stacker robot.
Фиг.8 - результат планирования движения робота- штабелера в области допустимого движения классическим способом, на основании габаритов робота, без учета контуров элементарных траекторий. Fig.8 - the result of planning the movement of the stacker robot in the area of admissible movement in the classical way, based on the dimensions of the robot, without taking into account the contours of the elementary trajectories.
Фиг.9 - результат планирования движения робота-штабелера в области допустимого движения с фиг.8 согласно варианту осуществления изобретения. Fig. 9 is a result of motion planning of the stacker robot in the allowable motion area of Fig. 8 according to an embodiment of the invention.
Фиг.10 - результат планирования движения робота- штабелера в области допустимого движения классическим способом, на основании габаритов робота, без учета контуров элементарных траекторий, в случае обнаружения статических препятствий. Fig.10 - the result of planning the movement of the stacker robot in the area of admissible movement in the classical way, based on the dimensions of the robot, without taking into account the contours of elementary trajectories, in case of detection of static obstacles.
Фиг.11 - результат планирования движения робота- штабелера в области допустимого движения с фиг.10 согласно варианту осуществления изобретения. Fig. 11 is a result of motion planning of the stacking robot in the allowable motion area of Fig. 10 according to an embodiment of the invention.
ОСУЩЕСТВЛЕНИЕ ИЗОБРЕТЕНИЯ IMPLEMENTATION OF THE INVENTION
Изобретение направлено на оптимизацию планирования движения робота, оснащенного датчиками безопасности и датчиками превентивного обнаружения препятствий, в области допустимого движения на плоскости. В рамках области допустимого движения появление и исчезновение статических препятствий считается редким событием. Концепция области допустимого движения применима, например, для складского помещения с известной геометрией, а также для многих других пространств, подлежащих измерению и контролю. Пространство вне области допустимого движения с большой вероятностью содержит статические препятствия, являющиеся постоянными для рассматриваемого окружения. The invention is aimed at optimizing the planning of the movement of a robot equipped with safety sensors and sensors for preventive obstacle detection in the area of permissible movement on a plane. Within the area of acceptable movement, the appearance and disappearance of static obstacles is considered a rare event. The concept of the area of permissible movement is applicable, for example, to a warehouse with a known geometry, as well as to many other spaces, subject to measurement and control. The space outside the area of admissible movement contains with a high probability static obstacles that are constant for the considered environment.
Для ясности предполагается, что робот имеет одно ведущее колесо, проскальзыванием которого можно пренебречь. Примером подобного робота является роботизированный электрический штабелер 1, изображенный на Фиг.1, в котором было реализовано настоящее изобретение. Здесь и далее термины «робот», «мобильный робот», «робот-штабелер», «штабелер» применяются взаимозаменяемо и обозначают робота, в котором реализовано настоящее изобретение, если иное не указано прямо. Вместе с тем необходимо понимать, что изобретение не ограничено в этом отношении и с успехом может быть реализовано на базе любого мобильного робота, кинематическая модель которого сводима к кинематической модели робота с одним ведущим колесом , в частности, в различных роботизированных складских транспортных средствах, таких как тягач, складская тележка, ричтрак и т.п. . For clarity, it is assumed that the robot has one drive wheel, the slip of which can be neglected. An example of such a robot is the robotic electric stacker 1 shown in FIG. 1, in which the present invention has been implemented. Hereinafter, the terms "robot", "mobile robot", "stacker robot", "stacker" are used interchangeably and refer to the robot in which the present invention is implemented, unless otherwise expressly indicated. At the same time, it should be understood that the invention is not limited in this regard and can be successfully implemented on the basis of any mobile robot, the kinematic model of which is reducible to the kinematic model of a robot with one driving wheel, in particular, in various robotic warehouse vehicles, such as tractor, storage trolley, reach truck, etc. .
Датчики безопасности 2 робота в режиме реального времени проверяют наличие препятствий в некоторой области видимости, определяемой углом поворота и скоростью ведущего колеса 3, называемой зоной безопасности. При обнаружении препятствия в зоне безопасности датчик безопасности соответствующим образом ограничивает скорость движения робота. Датчики превентивного обнаружения препятствий 4 робота также работают в режиме реального времени и имеют области видимости, превосходящие области видимости датчиков безопасности. При этом, как показано на Фиг.1, сенсорная часть системы датчиков превентивного обнаружения препятствий 4 может быть по меньшей мере частично объединена с сенсорной частью системы датчиков безопасности 2, при условии наличия у каждой из систем датчиков безопасности и превентивного обнаружения препятствий собственных подсистем обработки данных и исполнительных механизмов. The safety sensors 2 of the robot check in real time the presence of obstacles in a certain area of visibility, determined by the angle of rotation and the speed of the drive wheel 3, called the safety zone. When an obstacle is detected in the safety zone, the safety sensor limits the speed of the robot accordingly. Proactive obstacle detection sensors 4 robots also work in real time and have areas of view that exceed those of safety sensors. In this case, as shown in Fig.1, the sensor part of the sensor system of preventive obstacle detection 4 can be at least partially combined with the sensor part of the safety sensor system 2, provided that each of the safety sensor systems and preventive detection of obstacles has its own data processing subsystems and executive mechanisms.
На рассматриваемой плоскости вводятся две Декартовы правосторонние системы координат: фиксированная, глобальная система координат и связанная с ведущим колесом 3 робота, локальная система координат, как показано на Фиг.2 на примере робота- штабелера 1. Таким образом, положение робота на плоскости, далее называемое состоянием робота, может быть представлено тремя величинами: смещением и поворотом точки отсчета локальной системы координат относительно глобальной. Совокупность всех возможных состояний робота в области допустимого движения образует пространство состояний робота. Как было упомянуто выше, робот имеет одно ведущее колесо или может быть представлен кинематической моделью с одним ведущим колесом, известен диапазон возможных углов его поворота, а также диапазон возможных скоростей. Предполагается, что проскальзыванием ведущего колеса робота можно пренебречь, принимается кинематическая модель движения. Указанные допущения уместны и обоснованы для большого диапазона задач, в частности, для планирования движения роботов в закрытых помещениях, таких как складские помещения. Более того, практика показывает, что перечисленные допущения могут приниматься и для планирования движения мобильных роботов на открытых пространствах. В этих случаях погрешностями из-за возможного проскальзывания ведущего колеса роботы можно пренебречь, или же компенсировать их с помощью системы управления робота, отслеживающей его местоположение и скорость. В начале способа планирования движения робота настоящего изобретения осуществляется дискретизация пространства состояний робота: в области допустимого движения вводится сетка с фиксированным шагом, а также выбирается конечное множество углов поворота робота. Пример множества углов поворота 5, выбранного для робота-штабелера 1, проиллюстрирован на Фиг.З. On the considered plane, two Cartesian right-handed coordinate systems are introduced: a fixed, global coordinate system and associated with the drive wheel 3 of the robot, the local coordinate system, as shown in Fig.2 using the example of the stacker robot 1. Thus, the position of the robot on the plane, hereinafter referred to as the state of the robot can be represented by three values: displacement and rotation of the reference point of the local coordinate system relative to the global one. The set of all possible states of the robot in the area of permissible movement forms the state space of the robot. As mentioned above, the robot has one drive wheel or can be represented by a kinematic model with one drive wheel, the range of possible rotation angles is known, as well as the range of possible speeds. It is assumed that the slippage of the driving wheel of the robot can be neglected, and a kinematic model of motion is adopted. These assumptions are relevant and justified for a wide range of tasks, in particular, for planning the movement of robots in enclosed spaces, such as warehouses. Moreover, practice shows that the above assumptions can also be made for planning the movement of mobile robots in open spaces. In these cases, errors due to the possible slippage of the driving wheel of the robot can be neglected, or they can be compensated using the robot's control system that tracks its location and speed. At the beginning of the robot motion planning method of the present invention, the state space of the robot is discretized: a grid with a fixed step is introduced in the area of permissible motion, and a finite set of robot rotation angles is selected. An example of a plurality of rotation angles 5 selected for a stacker robot 1 is illustrated in FIG.
Таким образом, дискретное состояние робота представляется индексами ближайшей вершины сетки в области допустимого движения и индексом ближайшего угла поворота. Соответствующие траектории, проходимые точкой отсчета локальной системы координат робота, состоят из отрезков прямых, дуг окружностей и точек поворота на месте. Каждый отдельный участок такой траектории, называемый далее элементарной траекторией, определяется тремя параметрами: углом поворота ведущего колеса, его скоростью, а также длительностью движения. Пример элементарной траектории 6, представляющей собой путь, проходимый точкой отсчета локальной системы координат за некоторый период времени при фиксированном угле поворота 7 и скорости движения V ведущего колеса 3 робота-штабелера 1 изображен на Фиг.4. Thus, the discrete state of the robot is represented by the indices of the nearest grid vertex in the area of permissible movement and the index of the nearest rotation angle. Corresponding trajectories traversed by the point of reference of the robot's local coordinate system consist of line segments, circular arcs and turning points in place. Each separate section of such a trajectory, further called an elementary trajectory, is determined by three parameters: the angle of rotation of the drive wheel, its speed, and the duration of movement. An example of an elementary trajectory 6, which is a path traversed by the reference point of the local coordinate system for a certain period of time at a fixed angle of rotation 7 and the speed V of the drive wheel 3 of the stacker robot 1 is shown in Fig.4.
С учетом этого, в способе согласно изобретению, задают конечное множество элементарных траекторий с достаточной точностью соединяющих пары различных дискретных состояний робота в пространстве состояний робота. На Фиг.5 можно видеть пример выборки из множества элементарных траекторий 8 робота- штабелера 1. With this in mind, in the method according to the invention, a finite set of elementary trajectories are set with sufficient accuracy connecting pairs of different discrete states of the robot in the state space of the robot. In Fig.5 you can see an example of a selection from the set of elementary trajectories 8 of the robot stacker 1.
Угол поворота колеса робота и его скорость полностью определяют область видимости датчиков безопасности при движении робота по элементарной траектории. С учетом этого, в способе согласно изобретению, для каждой элементарной траектории задают зону безопасности на основании области видимости датчиков безопасности робота при данных угле поворота и скорости движения ведущего колеса. Далее для каждой элементарной траектории задают базовый контур, представляющий собой объединение зон безопасности с габаритами робота. Наконец, для каждой элементарной траектории задают контур элементарной траектории, представляющий собой объединение базовых контуров, помещенных в каждое промежуточное состояние элементарной траектории. Несколько примеров контуров элементарных траекторий робота-штабелера 1 представлено на Фиг.б и 7. На каждом из чертежей на Фиг.б и 7 проиллюстрированы контуры 9, 10, 11, 12 и 13 элементарных траекторий, связывающих одни и те же начальное и конечное состояния, но соответствующих разным скоростям движения робота- штабелера 1; а также показан путь 14, который в этих случаях проходит точка отсчета локальной системы координат робота. На каждой из фигур, контур 9, отмеченный знаками треугольника, соответствует скорости движения робота-штабелера в 0.3 м/с; контур 10, отмеченный знаками квадрата, соответствует скорости в 0.7 м/с; контур 11, отмеченный знаками прямого креста, соответствует скорости в 1.0 м/с; контур 12, отмеченный знаками ромба, соответствует скорости в 1.38 м/с; и контур 13, отмеченный знаками наклоненного креста, соответствует скорости в 1.67 м/с. The angle of rotation of the robot wheel and its speed completely determine the field of view of the safety sensors when the robot moves along an elementary trajectory. With this in mind, in the method according to the invention, for each elementary trajectory, a safety zone is set based on the field of view of the robot's safety sensors. given the angle of rotation and the speed of the drive wheel. Further, for each elementary trajectory, a basic contour is set, which is a combination of safety zones with the dimensions of the robot. Finally, for each elementary trajectory, the contour of the elementary trajectory is set, which is the union of the basic contours placed in each intermediate state of the elementary trajectory. Several examples of the contours of the elementary trajectories of the stacker robot 1 are shown in Fig.b and 7. In each of the drawings in Fig.b and 7, the contours 9, 10, 11, 12 and 13 of elementary trajectories connecting the same initial and final states are illustrated. , but corresponding to different speeds of movement of the robot stacker 1; and also shows the path 14, which in these cases passes the reference point of the local coordinate system of the robot. On each of the figures, contour 9, marked with triangles, corresponds to the speed of the stacker robot in 0.3 m/s; contour 10, marked with square signs, corresponds to a speed of 0.7 m/s; contour 11, marked with a straight cross, corresponds to a speed of 1.0 m/s; contour 12, marked with diamond signs, corresponds to a speed of 1.38 m/s; and contour 13, marked with signs of an inclined cross, corresponds to a speed of 1.67 m/s.
Поскольку робот может двигаться вдоль данной траектории с некоторой погрешностью, в дополнительном варианте осуществления изобретения базовый контур каждой элементарной траектории расширяют на величину такой погрешности. В данном варианте осуществления изобретение может использоваться в том числе для планирования движения робота на открытых пространствах, где возможно проскальзывание ведущего колеса робота. Since the robot can move along this trajectory with some error, in an additional embodiment of the invention, the basic contour of each elementary trajectory is expanded by the amount of such an error. In this embodiment, the invention can be used, among other things, for planning the movement of the robot in open spaces where slippage of the driving wheel of the robot is possible.
Заданная область допустимого движения робота в глобальной системе координат может быть представлена, например, набором плоских многоугольников. Данная область является фиксированной, и для учета возможности кратковременного появления в ней препятствий используются данные с датчиков превентивного обнаружения препятствий. The given area of allowed movement of the robot in the global coordinate system can be represented, for example, by a set of flat polygons. This area is fixed, and to take into account the possibility of short-term occurrence of obstacles in it, data from sensors of preventive obstacle detection is used.
Согласно заявленному способу, однократно строится ориентированный взвешенный мультиграф без петель, далее для краткости называемый просто мультиграф, вершины которого соответствуют дискретным состояниям робота, а дуги соответствуют элементарным траекториям. В мультиграф включаются лишь такие дуги, контуры элементарных траекторий которых полностью лежат в области допустимого движения, а также лишь те вершины, из которых исходит хотя бы одна дуга. В качестве весов дуг используют время движения по элементарным траекториям. Таким образом, путь в мультиграфе с наименьшей суммой весов на дугах позволит достичь целевого состояния за наименьшее время. В соответствии с этим, способ планирования движения робота настоящего изобретения содержит определение последовательности элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе пути с наименьшей суммой весов. According to the claimed method, an oriented weighted multigraph without loops is built once, hereinafter referred to simply as a multigraph for brevity, the vertices of which correspond to the discrete states of the robot, and the arcs correspond to elementary trajectories. The multigraph includes only those arcs whose elementary trajectory contours lie completely in the region of admissible motion, as well as only those vertices from which at least one arc originates. As the weights of the arcs, the time of movement along elementary trajectories is used. Thus, the path in the multigraph with the smallest sum of weights on the arcs will allow reaching the target state in least time. Accordingly, the robot motion planning method of the present invention comprises determining a sequence of elementary trajectories for the robot to move to a target state by searching the constructed multigraph for the path with the smallest sum of weights.
Поиск пути в мультиграфе может быть осуществлен при помощи различных известных алгоритмов, таких как A*, D*, RTAA*, LSS-LRTA* и др. Изобретение не ограничено в отношении алгоритма для поиска пути в мультиграфе, и любой соответствующий алгоритм, в том числе алгоритмы, которые могут быть разработаны в будущем, может с успехом применяться во всех вариантах осуществления настоящего изобретения. Pathfinding in a multigraph can be performed using various well-known algorithms such as A*, D*, RTAA*, LSS-LRTA*, etc. The invention is not limited to an algorithm for finding a path in a multigraph, and any appropriate algorithm, including including algorithms that may be developed in the future, can be successfully applied in all embodiments of the present invention.
Кратные дуги в мультиграфе соответствуют элементарным траекториям с одинаковым углом поворота ведущего колеса и одинаковой длиной, но различной скоростью и различным временем движения, т.е. различным весом. Очевидно, что дуга с наибольшей скоростью (наименьшим весом) будет наиболее предпочтительной среди всех кратных дуг, однако, поскольку ей также соответствует и наибольший контур, она может быть исключена из рассмотрения в процессе перестроения пути в ходе движения робота, в случае обнаружения пересекающегося с таким контуром препятствия. Multiple arcs in the multigraph correspond to elementary trajectories with the same angle of rotation of the drive wheel and the same length, but different speeds and different travel times, i.e. different weight. It is obvious that the arc with the highest speed (least weight) will be the most preferable among all multiple arcs, however, since it also corresponds to the largest contour, it can be excluded from consideration in the process of rebuilding the path during the movement of the robot, if it is found to intersect with such obstacle outline.
Для этого в варианте осуществления изобретения, способ дополнительно содержит этапы, на которых: осуществляют движение робота согласно выбранной последовательности элементарных траекторий и их скоростей и в режиме реального времени осуществляют проверку окружающей робота области на наличие статических препятствий с помощью датчиков превентивного обнаружения препятствий. Контуры выбранной последовательности элементарных траекторий проверяют на наличие пересечения с обнаруженными статическими препятствиями, и при наличии указанного пересечения определяют новую последовательность элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе нового пути с наименьшей суммой весов, при этом из поиска исключают все дуги, контуры элементарных траекторий которых пересекаются с обнаруженными статическими препятствиями, а перебор кратных дуг осуществляют в порядке возрастания веса, до обнаружения дуги, контур элементарной траектории которой не пересекается с обнаруженными статическими препятствиями. Последнее правило перебора кратных дуг повышает эффективность заявленного способа, поскольку увеличивает скорость поиска нового пути в мультиграфе, не ухудшая результатов поиска. При этом, согласно предпочтительному варианту осуществления изобретения, область видимости датчиков превентивного обнаружения препятствий робота, превышающую область видимости датчиков безопасности робота, на основе показаний которых скорость робота может быть ограничена, подбирают таким образом, что определение новой последовательности элементарных траекторий для движения робота в целевое состояние из-за обнаружения статического препятствия датчиками превентивного обнаружения препятствий осуществляется без ограничения скорости движения робота. Другими словами, разницу в области видимости датчиков превентивного обнаружения препятствий и датчиков безопасности робота подбирают так, чтобы после срабатывания датчиков превентивного обнаружения препятствий робот успевал перестроить и изменить траекторию движения до срабатывания датчиков безопасности, даже в случае движения с максимальной скоростью. To do this, in the embodiment of the invention, the method additionally comprises the steps of: moving the robot according to the selected sequence of elementary trajectories and their speeds, and in real time checking the area surrounding the robot for the presence of static obstacles using preventive obstacle detection sensors. The contours of the selected sequence of elementary trajectories are checked for the presence of intersection with the detected static obstacles, and in the presence of the specified intersection, a new sequence of elementary trajectories is determined for the robot to move to the target state by searching in the constructed multigraph for a new path with the smallest sum of weights, while all arcs are excluded from the search, the contours of the elementary trajectories of which intersect with the detected static obstacles, and the enumeration of multiple arcs is carried out in order of increasing weight, until an arc is found, the contour of the elementary trajectory of which does not intersect with the detected static obstacles. The last rule for enumeration of multiple arcs increases the efficiency of the claimed method, since it increases the speed of finding a new path in a multigraph without worsening the search results. At the same time, according to a preferred embodiment of the invention, the field of view of the robot's preventive obstacle detection sensors, which exceeds the field of view of the robot's safety sensors, based on the indications of which the robot's speed can be limited, is selected in such a way that the definition of a new sequence of elementary trajectories for the robot to move to the target state due to the detection of a static obstacle by sensors, preventive obstacle detection is carried out without limiting the speed of the robot. In other words, the difference in the field of view of the preventive obstacle detection sensors and the safety sensors of the robot is selected so that after the preventive obstacle detection sensors are triggered, the robot has time to rebuild and change the movement trajectory before the safety sensors are triggered, even in the case of movement at maximum speed.
Как было упомянуто выше, изобретение было реализовано в программноаппаратном комплексе роботизированного электрического штабелера 1, изображенного на Фиг.1. Указанный штабелер 1 является мобильным роботом, представляющим собой отдельный объект настоящего изобретения. Реализация изобретения на базе робота- штабелера 1 описана ниже в подробностях для обеспечения понимания сущности изобретения. Вместе с тем, необходимо понимать, что все представленные технические подробности, значения и величины являются лишь примерами одного или нескольких вариантов осуществления изобретения, и никоим образом не ограничивают объем правовой защиты, определяемый формулой изобретения. As mentioned above, the invention was implemented in the hardware and software system of the robotic electric stacker 1 shown in Fig.1. The specified stacker 1 is a mobile robot, which is a separate object of the present invention. The implementation of the invention based on the stacker robot 1 is described below in detail to provide an understanding of the essence of the invention. However, it should be understood that all technical details, meanings and values presented are merely examples of one or more embodiments of the invention, and in no way limit the scope of the legal protection provided by the claims.
Как показано на Фиг.1, робот-штабелер 1 оснащен двумя лазерными сканерами, расположенными в его передней части по бокам и сочетающими в себе функции сенсорной части датчиков безопасности 2 и датчиков превентивного обнаружения препятствий 4. Объединение сенсорной части датчиков безопасности и превентивного обнаружения препятствий предпочтительна для повышения компактности и снижения стоимость оборудования робота, однако не является единственно возможным решением. С равным успехом датчики безопасности и датчики превентивного обнаружения препятствий могут быть реализованы в виде отдельных устройств или модулей. As shown in Fig.1, the stacker robot 1 is equipped with two laser scanners located in its front part on the sides and combining the functions of the sensor part of the safety sensors 2 and sensors of preventive obstacle detection 4. Combining the sensor part of safety sensors and preventive obstacle detection is preferable to increase the compactness and reduce the cost of the robot equipment, but is not the only possible solution. With equal success, safety sensors and sensors for preventive obstacle detection can be implemented as separate devices or modules.
Робот-штабелер 1 имеет одно ведущее колесо 3, угол его поворота (р лежит в диапазоне [-90, 90] град, а линейная скорость V — в диапазоне [-0.3, 1.67] м/с, например, как показано на Фиг.4. Колесная база L составляет 1.386 м. Исходя из параметров задачи на этапе дискретизации пространства состояний на плоскости была введена сетка с шагом 0.1 м по осям ОХ и OY глобальной системы координат, показанной на Фиг.2, а также зафиксировано множество 5 из 24 углов поворота ведущего колеса 3 робота, изображенное на Фиг.З. Далее было зафиксировано множество из 918 элементарных траекторий, выборка 8 из которых для примера показана на Фиг.5. Изобретение не ограничено в отношении всех указанных параметров, шаг сетки, количество дискретных углов поворота и элементарных траекторий робота могут быть заданы по другому, в зависимости от условий решаемой задачи, требуемой точности, доступных вычислительных мощностей и т.п. The stacker robot 1 has one driving wheel 3, its rotation angle (p lies in the range of [-90, 90] degrees, and the linear speed V lies in the range of [-0.3, 1.67] m/s, for example, as shown in Fig. 4. The wheelbase L is 1.386 m. Based on the parameters of the problem, at the stage of discretization of the state space on the plane, a grid was introduced with a step of 0.1 m along the axes OX and OY of the global coordinate system shown in Fig.2, and also fixed set 5 of 24 rotation angles of the driving wheel 3 of the robot, shown in Fig.Z. Next, a set of 918 elementary trajectories was recorded, a sample of 8 of which is shown in Fig.5 for example. The invention is not limited in respect of all the specified parameters, the grid spacing, the number of discrete rotation angles and elementary trajectories of the robot can be specified differently, depending on the conditions of the problem being solved, the required accuracy, available computing power, etc.
Исходя из указанных выше параметров, был применен способ планирования движения штабелера 1 согласно изобретению. На Фиг.б и 7 показаны примеры контуров элементарных траекторий, вычисленных для робота- штабелера 1: в каждом случае показан набор контуров элементарной траектории 9, 10, 11, 12 и 13, связывающих одни и те же начальное и конечное состояния, но соответствующих разным скоростям движения робота, от 0.3 м/с до 1.67 м/с, как было указано выше. Based on the above parameters, the method of planning the movement of the stacker 1 according to the invention was applied. Figures b and 7 show examples of the contours of elementary trajectories calculated for the stacker robot 1: in each case, a set of contours of the elementary trajectory 9, 10, 11, 12 and 13 is shown, linking the same initial and final states, but corresponding to different speeds of the robot, from 0.3 m/s to 1.67 m/s, as mentioned above.
На основании данных параметров было осуществлено планирование движения штабелера 1 в различных областях допустимого движения способом согласно вариантам осуществления изобретения, а также классическим способом, без учета зон безопасности и контуров элементарных траекторий, описанных выше, что позволяет сравнить результаты планирования. Based on these parameters, the movement of the stacker 1 was planned in various areas of permissible movement by the method according to the embodiments of the invention, as well as by the classical method, without taking into account the safety zones and contours of the elementary trajectories described above, which allows comparing the planning results.
На Фиг.8 показан пример планирования движения робота- штабелера 1 из точки А в точку В в заданной области допустимого движения с границами 15 классическим способом, на основании габаритов робота-штабелера 1. На Фиг.9 представлен результат применения варианта осуществления настоящего изобретения для планирования движения робота- штабелера 1 в условиях, аналогичных показанным на Фиг.8. Еще один пример планирования движения робота-штабелера 1 классическим способом представлен на Фиг.10, в этом случае происходит обнаружение статических препятствий 16 во время движения робота в области допустимого движения. На Фиг.11 представлен результат применения варианта осуществления настоящего изобретения для планирования движения робота- штабелера 1 в условиях, аналогичных показанным на Фиг.10. Figure 8 shows an example of planning the movement of the stacker robot 1 from point A to point B in a given area of permissible movement with boundaries 15 in the classical way, based on the dimensions of the stacker robot 1. Figure 9 shows the result of applying an embodiment of the present invention for planning movement of the robot stacker 1 under conditions similar to those shown in Fig.8. Another example of planning the movement of the robot stacker 1 in the classical way is shown in Fig.10, in this case, static obstacles 16 are detected during the movement of the robot in the area of permissible movement. FIG. 11 shows the result of applying an embodiment of the present invention to planning the motion of a stacking robot 1 under conditions similar to those shown in FIG. 10. FIG.
Сравнение траекторий движения робота на Фиг.8 и 9, 10 и 11 наглядно показывает, что благодаря оптимизации планирования движения робота в вариантах осуществления настоящего изобретения достигаются следующие полезные эффекты: робот сохраняет большую дистанцию от границы области допустимого движения, когда развивает большую скорость; при движении по узкому участку робот запланировано снижает скорость; повороты на «перекрестках», у границ зоны допустимого движения, робот осуществляет более плавно и на большой скорости. Описанные выше варианты осуществления являются лишь примерными, конкретные параметры, значения и величины, используемые в них, также следует трактовать в качестве неограничивающих примеров. После прочтения настоящего описания специалисты в данной области техники могут предложить различные изменения и корректировки описанных вариантов осуществления, не изменяющих сущности заявленного изобретения. Все такие изменения и корректировки попадают в объем правовой защиты, определяемой формулой изобретения. Comparison of the robot motion trajectories in Figs. 8 and 9, 10 and 11 clearly shows that by optimizing the planning of the robot motion in the embodiments of the present invention, the following beneficial effects are achieved: the robot maintains a greater distance from the boundary of the allowable motion area when it develops a high speed; when moving along a narrow section, the robot deliberately reduces speed; turns at "crossroads", at the boundaries of the zone of permissible movement, the robot performs more smoothly and at high speed. The embodiments described above are exemplary only, the specific parameters, values and quantities used therein should also be construed as non-limiting examples. After reading the present description, specialists in the art may suggest various changes and adjustments to the described embodiments without changing the essence of the claimed invention. All such changes and modifications fall within the scope of the legal protection of the claims.

Claims

ФОРМУЛА ИЗОБРЕТЕНИЯ CLAIM
1. Способ планирования движения робота в области допустимого движения на плоскости, содержащий этапы, на которых: осуществляют дискретизацию пространства состояний робота посредством введения в области допустимого движения сетки с фиксированным шагом и выбора конечного множества углов поворота, задают конечное множество элементарных траекторий в локальной системе координат робота, определяемых углом поворота ведущего колеса, его скоростью и длительностью движения, и соединяющих пары различных дискретных состояний робота в указанном пространстве, для каждой элементарной траектории: задают зону безопасности на основании области видимости датчиков безопасности робота при данных угле поворота и скорости движения ведущего колеса, задают базовый контур посредством объединения зон безопасности с габаритами робота, и задают контур элементарной траектории посредством объединения базовых контуров, помещенных в каждое промежуточное состояние элементарной траектории, строят ориентированный взвешенный мультиграф без петель, вершины которого соответствуют дискретным состояниям робота, дуги соответствуют элементарным траекториям, а вес дуги соответствует времени движения робота по элементарной траектории, причем в граф включают лишь дуги, контуры элементарных траекторий которых полностью лежат в заданной области допустимого движения, и лишь те вершины, из которых исходит хотя бы одна дуга, и определяют последовательность элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе пути с наименьшей суммой весов. 1. A method for planning the movement of a robot in the area of allowable movement on a plane, comprising the steps at which: the state space of the robot is discretized by introducing a grid with a fixed step into the area of allowable movement and choosing a finite set of rotation angles, specifying a finite set of elementary trajectories in the local coordinate system of the robot, determined by the angle of rotation of the driving wheel, its speed and duration of movement, and connecting pairs of different discrete states of the robot in the specified space, for each elementary trajectory: a safety zone is set based on the field of view of the robot's safety sensors at a given angle of rotation and speed of the driving wheel, define the basic contour by combining the safety zones with the dimensions of the robot, and define the contour of the elementary trajectory by combining the basic contours placed in each intermediate state of the elementary trajectory, build an oriented weighted multigraph without loops, whose vertices correspond to the discrete states of the robot, the arcs correspond to elementary trajectories, and the weight of the arc corresponds to the time of the robot’s movement along the elementary trajectory, and the graph includes only arcs whose elementary trajectory contours lie completely in the given region of admissible motion, and only those vertices from which at least one arc emanates and determine the sequence of elementary trajectories for the robot to move to the target state by searching the constructed multigraph for the path with the smallest sum of weights.
2. Способ по п.1, дополнительно содержащий этап, на котором: базовый контур каждой элементарной траектории расширяют на величину погрешности движения робота по траектории. 2. The method according to claim 1, further comprising the step of: expanding the basic contour of each elementary trajectory by the amount of the error in the movement of the robot along the trajectory.
3. Способ по п.1 или 2, дополнительно содержащий этапы, на которых: осуществляют движение робота согласно выбранной последовательности элементарных траекторий и их скоростей, в режиме реального времени осуществляют проверку окружающей робота области на наличие статических препятствий с помощью датчиков превентивного обнаружения препятствий, проверяют контуры выбранной последовательности элементарных траекторий на наличие пересечения с обнаруженными статическими препятствиями, и при наличии указанного пересечения определяют новую последовательность элементарных траекторий для движения робота в целевое состояние посредством поиска в построенном мультиграфе нового пути с наименьшей суммой весов, при этом из поиска исключают все дуги, контуры элементарных траекторий которых пересекаются с обнаруженными статическими препятствиями, а перебор кратных дуг осуществляют в порядке возрастания веса, до обнаружения дуги, контур элементарной траектории которой не пересекается с обнаруженными статическими препятствиями. 3. The method of claim 1 or 2, further comprising the steps of: move the robot according to the selected sequence of elementary trajectories and their speeds, in real time check the area surrounding the robot for the presence of static obstacles using preventive obstacle detection sensors, check the contours of the selected sequence of elementary trajectories for the presence of intersection with the detected static obstacles, and in the presence of the specified intersections determine a new sequence of elementary trajectories for the robot to move to the target state by searching in the constructed multigraph for a new path with the smallest sum of weights, while all arcs are excluded from the search, the contours of elementary trajectories of which intersect with the detected static obstacles, and the multiple arcs are searched in ascending order weight, until the detection of an arc, the contour of the elementary trajectory of which does not intersect with the detected static obstacles.
4. Способ по пункту 3, в котором область видимости датчиков превентивного обнаружения препятствий робота превышает область видимости датчиков безопасности робота, так что определение новой последовательности элементарных траекторий для движения робота в целевое состояние из-за обнаружения статического препятствия датчиками превентивного обнаружения препятствий осуществляют без ограничения скорости движения робота. 4. The method according to claim 3, in which the visibility area of the robot's preventive obstacle detection sensors exceeds the visibility area of the robot's safety sensors, so that the determination of a new sequence of elementary trajectories for the robot to move to the target state due to the detection of a static obstacle by the preventive obstacle detection sensors is carried out without speed limitation robot movements.
5. Мобильный робот, содержащий: шасси с ведущим колесом для обеспечения движения робота с заданным диапазоном скоростей, датчики безопасности для обнаружения препятствий в окружающей робота области видимости датчиков безопасности, и коммуникативно связанную с датчиками безопасности систему управления, выполненную с возможностью планирования движения робота в области допустимого движения на плоскости согласно способу по пункту 1 или 2, и управления шасси для осуществления движения робота. 5. A mobile robot comprising: a chassis with a driving wheel to ensure the movement of the robot with a given speed range, safety sensors to detect obstacles in the field of view of the safety sensors surrounding the robot, and a control system communicatively connected with the safety sensors, made with the possibility of planning the movement of the robot in the area allowable movement on the plane according to the method according to paragraph 1 or 2, and control of the chassis to carry out the movement of the robot.
6. Мобильный робот по и.5, дополнительно содержащий коммуникативно связанные с системой управления датчики превентивного обнаружения препятствий для обнаружения препятствий в окружающей робота области видимости датчиков превентивного обнаружения препятствий, превышающей область видимости датчиков безопасности робота. 6. The mobile robot according to claim 5, additionally containing preventive obstacle detection sensors communicatively connected to the control system for detecting obstacles in the visibility area of the preventive obstacle detection sensors surrounding the robot, which exceeds the visibility area of the robot's safety sensors.
7. Мобильный робот по п.6, в котором система управления выполнена с возможностью планирования движения робота в области допустимого движения на плоскости согласно способу по пункту 3 или 4. 7. Mobile robot according to claim 6, in which the control system is configured to plan the movement of the robot in the area of admissible movement on the plane according to the method according to paragraph 3 or 4.
8. Мобильный робот по любому из пи.5-7, представляющий собой роботизированное складское транспортное средство, в частности, одно из штабелера, тягача, складской тележки и ричтрака. 8. Mobile robot according to any one of pi.
PCT/RU2021/050336 2020-12-07 2021-10-10 Robot motion planning method and mobile robot WO2022124938A1 (en)

Applications Claiming Priority (2)

Application Number Priority Date Filing Date Title
RU2020140083A RU2749202C1 (en) 2020-12-07 2020-12-07 Method for planning robot movement and mobile robot
RU2020140083 2020-12-07

Publications (1)

Publication Number Publication Date
WO2022124938A1 true WO2022124938A1 (en) 2022-06-16

Family

ID=76301476

Family Applications (1)

Application Number Title Priority Date Filing Date
PCT/RU2021/050336 WO2022124938A1 (en) 2020-12-07 2021-10-10 Robot motion planning method and mobile robot

Country Status (2)

Country Link
RU (1) RU2749202C1 (en)
WO (1) WO2022124938A1 (en)

Families Citing this family (1)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN114200945B (en) * 2021-12-13 2024-04-02 长三角哈特机器人产业技术研究院 Safety control method of mobile robot

Citations (4)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN104407616A (en) * 2014-12-03 2015-03-11 沈阳工业大学 Dynamic path planning method for mobile robot based on immune network algorithm
CN104932493A (en) * 2015-04-01 2015-09-23 上海物景智能科技有限公司 Autonomous navigation mobile robot and autonomous navigation method thereof
RU2634857C2 (en) * 2012-09-27 2017-11-07 Конинклейке Филипс Н.В. Autonomous mobile robot and method for its operation
RU2680628C2 (en) * 2014-04-17 2019-02-25 Софтбэнк Роботикс Юроп Omnidirectional wheeled humanoid robot based on linear predictive position and velocity controller

Family Cites Families (2)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
KR101048098B1 (en) * 2008-09-03 2011-07-11 한국과학기술원 Robot route planning device and method
JP2011175393A (en) * 2010-02-24 2011-09-08 Toyota Motor Corp Route planning apparatus, autonomous mobile robot, and method for planning movement path

Patent Citations (4)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
RU2634857C2 (en) * 2012-09-27 2017-11-07 Конинклейке Филипс Н.В. Autonomous mobile robot and method for its operation
RU2680628C2 (en) * 2014-04-17 2019-02-25 Софтбэнк Роботикс Юроп Omnidirectional wheeled humanoid robot based on linear predictive position and velocity controller
CN104407616A (en) * 2014-12-03 2015-03-11 沈阳工业大学 Dynamic path planning method for mobile robot based on immune network algorithm
CN104932493A (en) * 2015-04-01 2015-09-23 上海物景智能科技有限公司 Autonomous navigation mobile robot and autonomous navigation method thereof

Also Published As

Publication number Publication date
RU2749202C1 (en) 2021-06-07

Similar Documents

Publication Publication Date Title
Sprunk et al. An accurate and efficient navigation system for omnidirectional robots in industrial environments
Lee et al. Navigation of automated guided vehicles using magnet spot guidance method
CN113710431B (en) Path planning method using sample-based optimal tree and recording medium
WO2019166518A1 (en) Path planning in mobile robots
US20200174482A1 (en) Online bidirectional trajectory planning method in state-time space, recording medium storing program for executing same, and computer program stored in recording medium for executing same
JP2024020457A (en) Information processing device, information processing method, computer program, and information processing system
CN112284393A (en) Global path planning method and system for intelligent mobile robot
Horst et al. Trajectory generation for an on-road autonomous vehicle
US20230118472A1 (en) Systems and methods for vehicle motion planning
Behrje et al. An autonomous forklift with 3d time-of-flight camera-based localization and navigation
CN115116220B (en) Unmanned multi-vehicle cooperative control method for mining area loading and unloading scene
WO2022124938A1 (en) Robot motion planning method and mobile robot
CN114012732B (en) Robot control method, device, equipment and medium
Heinemann et al. Generating smooth trajectories in local path planning for automated guided vehicles in production
Bai et al. An online approach for intersection navigation of autonomous vehicle
Brumitt et al. Dynamic trajectory planning for a cross-country navigator
Riman et al. Fuzzy Logic Control for Mobile Robot Navigation in Automated Storage
CN112286211A (en) Environment modeling and AGV path planning method for irregular layout workshop
Abi-Char et al. A Collision-Free Path Planning Algorithm for Non-Complex ASRS Using Heuristic Functions
Baxter et al. Fuzzy control of a mobile robotic vehicle
Dubova et al. Virtual Prototype of AGV-Based Warehouse System
Hellstrom et al. Real-time path planning using a simulator-in-the-loop
JP7187516B2 (en) Mobile object, mobile control system, mobile object control method and program
Nagel et al. The Culebra algorithm for path planning and obstacle avoidance in Kat-5
EP4071575A1 (en) Control method for mobile object, mobile object, and computer readable storage medium

Legal Events

Date Code Title Description
121 Ep: the epo has been informed by wipo that ep was designated in this application

Ref document number: 21903941

Country of ref document: EP

Kind code of ref document: A1

NENP Non-entry into the national phase

Ref country code: DE

122 Ep: pct application non-entry in european phase

Ref document number: 21903941

Country of ref document: EP

Kind code of ref document: A1