WO2023093594A1 - 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置 - Google Patents

一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置 Download PDF

Info

Publication number
WO2023093594A1
WO2023093594A1 PCT/CN2022/132273 CN2022132273W WO2023093594A1 WO 2023093594 A1 WO2023093594 A1 WO 2023093594A1 CN 2022132273 W CN2022132273 W CN 2022132273W WO 2023093594 A1 WO2023093594 A1 WO 2023093594A1
Authority
WO
WIPO (PCT)
Prior art keywords
robot
deviation
trajectory
pose
polishing
Prior art date
Application number
PCT/CN2022/132273
Other languages
English (en)
French (fr)
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 WO2023093594A1 publication Critical patent/WO2023093594A1/zh

Links

Images

Classifications

    • BPERFORMING OPERATIONS; TRANSPORTING
    • B25HAND TOOLS; PORTABLE POWER-DRIVEN TOOLS; MANIPULATORS
    • B25JMANIPULATORS; CHAMBERS PROVIDED WITH MANIPULATION DEVICES
    • B25J9/00Programme-controlled manipulators
    • B25J9/16Programme controls
    • B25J9/1656Programme controls characterised by programming, planning systems for manipulators
    • B25J9/1664Programme controls characterised by programming, planning systems for manipulators characterised by motion, path, trajectory planning
    • BPERFORMING OPERATIONS; TRANSPORTING
    • B25HAND TOOLS; PORTABLE POWER-DRIVEN TOOLS; MANIPULATORS
    • B25JMANIPULATORS; CHAMBERS PROVIDED WITH MANIPULATION DEVICES
    • B25J11/00Manipulators not otherwise provided for
    • B25J11/005Manipulators for mechanical processing tasks
    • B25J11/0065Polishing or grinding

Definitions

  • the invention relates to the technical field of robot control, in particular to a track deviation correction method and device for a floor grinding and polishing robot for error correction.
  • the floor grinding and polishing robot is a kind of equipment used for ground grinding and polishing. It is mainly used in the treatment of concrete, artificial stone, granite, and epoxy floors. It grinds the ground through a high-speed rotating grinding disc to make the ground smooth and smooth. It is a floor engineering treatment. mainstream devices. Inconsistencies in the flatness of the grinding ground lead to a reduction in the robot's navigation accuracy during the grinding process; factors such as ground depressions, protrusions, and water stains cause inconsistent frictional forces to cause the robot to jump, mainly manifested in heading angle deviation and lateral sideslip. , The autonomous deviation trajectory correction poses new challenges, and the study of its trajectory correction self-correction algorithm is one of the keys to improving the navigation accuracy of the autonomous navigation floor grinding and polishing robot.
  • Gang Huang proposed a method for correcting robot deviation in real time, combined with the particle swarm trajectory planning algorithm and applied it to the actual McCollum wheel robot to achieve fast and effective trajectory correction of the robot, and can handle small deviations.
  • the fly in the ointment is The trajectory deviation value dealt with in this experiment is small.
  • S. Mata, Li S E, etc. used model predictive control in actual situations, and set up the controller considering the actual vehicle running situation, which has a good control effect.
  • the disadvantage is that due to the difference in the kinematic model of the vehicle, it needs to be reset every time. Design control model.
  • the technical problem to be solved by the present invention is to provide an error correction method and device for correcting the trajectory of the floor grinding and polishing robot, so as to realize rapid correction of offset and ensure navigation accuracy.
  • the present invention provides an error correction method for correcting the trajectory of a floor grinding and polishing robot, including:
  • Step 10 Obtain the ideal trajectory covered by the robot, and set the point on the trajectory with a distance of L directly in front of the robot as the trajectory leading point of the robot; establish a motion control model for the floor grinding and polishing robot;
  • Step 20 during the movement of the robot along the path, obtain the motion state of the robot in real time, and then update the pose of the robot through an adaptive Monte Carlo algorithm;
  • Step 30 Calculate the deviation between the current pose of the robot and the leading point of the trajectory, and then convert the deviation into robot control instructions according to the motion control model, control the robot to move to obtain a new pose, and then return to step 20.
  • step 10 when applied to a floor grinding and polishing robot with a two-wheel differential structure chassis, the motion control model is specifically:
  • w represents the rotational angular velocity of the robot
  • v represents the velocity component in the forward direction generated by the driving wheel
  • represents the direction angle of the grinding and polishing robot in the global coordinates
  • represents the angle between the force direction and the motion direction of the floor grinding and polishing robot
  • F represents the force from the ground on the grinding disc
  • J represents the moment of inertia of the floor grinding and polishing robot
  • m represents the mass of the floor grinding and polishing robot
  • L is the leading distance.
  • the deviation between the current pose of the robot and the leading point of the trajectory is calculated, specifically:
  • e x represents the distance deviation in the X direction
  • e y represents the distance deviation in the Y direction
  • e ⁇ represents the angle deviation
  • P n (x n ,y n , ⁇ n ) is the current pose of the robot
  • P t (x t ,y t , ⁇ t ) is the leading point of the trajectory.
  • the deviation is converted into a robot control instruction, specifically:
  • the angle offset e ⁇ and the distance offsets e x and e y in the X-axis and Y-axis directions are respectively brought into the formula to obtain two sets of PID outputs;
  • u(t) is the deviation correction amount
  • k P is the proportional coefficient
  • k I is the integral coefficient
  • k D is the differential coefficient, when the input angle deviation e ⁇ is output as the angle control amount, when the input is the distance offset
  • the output is the speed control value.
  • the step 20 is specifically: when the robot is moving normally, the adaptive Monte Carlo algorithm superimposes the kinematics model on the basis of the original distribution to update the particle pose; in the case of the robot jumping, the adaptive Monte Carlo algorithm The Carlo algorithm redistributes the particles, starts a new round of iterative calculations, and finally obtains a result that accurately represents the real coordinates of the robot.
  • the present invention provides an error-correcting floor grinding and polishing robot trajectory correction device, including: an initialization module, a pose update module, and a motion control module;
  • the initialization module is used to obtain the ideal trajectory covered by the robot, and the point on the trajectory with a distance of L directly in front of the robot is set as the trajectory leading point of the robot; the motion control model of the floor grinding and polishing robot is established;
  • the pose update module is used to obtain the motion state of the robot in real time during the movement of the robot along the path, and then update the pose of the robot through an adaptive Monte Carlo algorithm;
  • the motion control module is used to calculate the deviation between the current pose of the robot and the leading point of the trajectory, and then convert the deviation into a control instruction of the robot according to the motion control model, and control the movement of the robot to obtain a new pose, and then Returns the pose update module.
  • the motion control model when applied to a floor grinding and polishing robot with a two-wheel differential structure chassis, the motion control model is specifically:
  • w represents the rotational angular velocity of the robot
  • v represents the velocity component in the forward direction generated by the driving wheel
  • represents the direction angle of the grinding and polishing robot in the global coordinates
  • represents the angle between the force direction and the motion direction of the floor grinding and polishing robot
  • F represents the force from the ground on the grinding disc
  • J represents the moment of inertia of the floor grinding and polishing robot
  • m represents the mass of the floor grinding and polishing robot
  • L is the leading distance.
  • the deviation between the current pose of the robot and the lead point of the track is calculated, specifically:
  • e x represents the distance deviation in the X direction
  • e y represents the distance deviation in the Y direction
  • e ⁇ represents the angle deviation
  • P n (x n ,y n , ⁇ n ) is the current pose of the robot
  • P t (x t ,y t , ⁇ t ) is the leading point of the trajectory.
  • the deviation is converted into robot control instructions, specifically:
  • the angle offset e ⁇ and the distance offsets e x and e y in the X-axis and Y-axis directions are respectively brought into the formula to obtain two sets of PID outputs;
  • u(t) is the deviation correction amount
  • k P is the proportional coefficient
  • k I is the integral coefficient
  • k D is the differential coefficient, when the input angle deviation e ⁇ is output as the angle control amount, when the input is the distance offset
  • the output is the speed control value.
  • the pose update module specifically includes: when the robot is moving normally, the adaptive Monte Carlo algorithm superimposes the kinematics model on the basis of the original distribution to update the particle pose; when the robot jumps, automatically Adapt to the Monte Carlo algorithm to redistribute the particles, start a new round of iterative calculations, and finally get a result that accurately represents the real coordinates of the robot.
  • the embodiment of the present invention adopts the method of advanced point control to ensure that the trajectory deviation of the robot is positive.
  • the robot runs along the trajectory while correcting, and then obtains the robot position in real time through the adaptive Monte Carlo algorithm, and advances according to the current position and trajectory. Points to obtain the deviation, and then solve the deviation into robot motion control instructions, and finally the positioning algorithm obtains the corrected pose, recalculates the error and control amount, and forms a closed-loop control.
  • the trajectory correction method proposed by the embodiment of the present invention can cope with a large degree of offset, and effectively solves the problem of trajectory deviation of the floor grinding and polishing robot.
  • Fig. 1 is the flowchart of the method in embodiment one of the present invention
  • Fig. 2 is a flow chart of the control system of the floor grinding and polishing robot in Embodiment 1 of the present invention
  • FIG. 3 is a schematic diagram of the kinematics of the grinding and polishing robot in Embodiment 1 of the present invention.
  • Fig. 4 is a schematic diagram of calculating the deviation amount in Embodiment 1 of the present invention.
  • Embodiment 1 of the present invention is a schematic diagram of two undisturbed experimental trajectories in Embodiment 1 of the present invention.
  • FIG. 6 is a schematic diagram of a disturbance experiment trajectory in Embodiment 1 of the present invention.
  • Example 7 is a schematic diagram of relative experimental deviation in Example 1 of the present invention.
  • Example 8 is a schematic diagram of the absolute deviation of two interference experiments in Example 1 of the present invention.
  • FIG. 9 is a schematic structural diagram of the device in Embodiment 2 of the present invention.
  • the embodiment of the present application provides an error correction method and device for correcting the trajectory of the floor grinding and polishing robot, so as to realize rapid correction of the offset and ensure the navigation accuracy.
  • the invention proposes a trajectory correction method based on the amount of error to solve the problem that the robot shakes and jumps greatly deviate from the trajectory due to uneven ground , and then realize the precise control of the autonomous navigation of the floor grinding and polishing robot.
  • the ideal trajectory covered by the floor grinding and polishing robot and set the trajectory lead point. Then, according to the current pose of the robot, the ideal trajectory point is selected as the tracking target point, and the position and attitude of the robot are obtained in real time through the Adaptive Deterministic Monte Carlo (AMCL), so as to calculate the deviation between the target point and the current position of the robot.
  • the deviation amount is calculated by the two PID controllers of distance and angle to obtain the control command of the motor, and control the movement of the robot to obtain a new pose. Continuously control the tracking and correction of the robot in a loop to realize a closed-loop system from positioning to correction.
  • the embodiment of the present invention proposes a trajectory correction method based on the error amount.
  • the trajectory correction method mainly includes robot positioning, the calculation method of the lead point error, and the deviation amount Computing algorithm with control instructions.
  • This embodiment provides an error correction method for correcting the trajectory of the floor grinding and polishing robot, as shown in Figure 1, including:
  • Step 10 Obtain the ideal trajectory covered by the robot, and set the point on the trajectory with a distance of L directly in front of the robot as the trajectory leading point of the robot; establish a motion control model for the floor grinding and polishing robot;
  • Step 20 during the movement of the robot along the path, obtain the motion state of the robot in real time, and then update the pose of the robot through an adaptive Monte Carlo algorithm;
  • Step 30 Calculate the deviation between the current pose of the robot and the leading point of the trajectory, and then convert the deviation into robot control instructions according to the motion control model, control the robot to move to obtain a new pose, and then return to step 20.
  • the method of leading point control can ensure that the trajectory deviation of the robot is positive, and the robot runs along the trajectory while correcting, and then obtains the position of the robot in real time through the adaptive Monte Carlo algorithm, and calculates the deviation according to the current position and the leading point of the trajectory Then the deviation is calculated as a robot motion control instruction, and finally the positioning algorithm obtains the corrected pose, and the error and control amount are recalculated to form a closed-loop control.
  • FIG. 2 is a flow chart of the control system of the floor grinding and polishing robot.
  • First plan the ideal trajectory covered by the floor grinding and polishing robot.
  • the ideal trajectory point is selected as the tracking target point, and the position and attitude of the robot are obtained in real time through the Adaptive Deterministic Monte Carlo (AMCL), so as to calculate the deviation between the target point and the current position of the robot.
  • the deviation amount is calculated by the two PID controllers of distance and angle to obtain the control command of the motor, and control the movement of the robot to obtain a new pose. Continuously control the tracking and correction of the robot in a loop to realize a closed-loop system from positioning to correction.
  • the floor grinding and polishing robot adopts a two-wheel differential structure chassis as an object, and the two-wheel differential structure chassis includes a large grinding disc that revolves and a small grinding disc that rotates. Among them, the frictional force from the ground is averaged by the relative rotation of the self-rotating grinding disc, and the revolution of the large grinding disc can make the force change periodically, reducing the influence of uneven force.
  • the robot coordinate system x c -y c and the absolute coordinate system XY are established with the center of the two wheels of the robot as the origin.
  • is the angle between Y and y c
  • the pose of the robot in the global coordinate system can be expressed as (x, y, ⁇ ).
  • the force state of the robot is analyzed.
  • the force during the movement includes the force of the grinding disc and the power of the two driving wheels.
  • F represents the force on the grinding disc from the ground.
  • the size and direction of F change continuously with the rotation of the grinding disc.
  • F x represents the component of F perpendicular to the direction of robot motion
  • F y represents the component of F along the direction of robot motion.
  • the distance between the point of action of F x and the turning center of the robot is L.
  • the force causes the robot to undergo rigid body rotation, as shown in formula 2.
  • the force parallel to the moving direction of the robot is deduced from the formula of Newton's second law, and F y produces the displacement of the robot along the direction of the robot, as shown in formula 3.
  • the effects of the two forces are superimposed on each other, resulting in the change of the angle of the robot and the jumping displacement along the angle direction.
  • w represents the rotational angular velocity of the robot
  • v y represents the instantaneous velocity of the robot in the forward direction
  • represents the angle between the force direction and the motion direction of the floor grinding and polishing robot
  • J represents the moment of inertia of the floor grinding and polishing robot
  • m represents the ground The quality of the ping grinding and polishing robot.
  • the motion control model of the grinding and polishing robot is composed of the dynamic model of the grinding disc superimposed on the kinematics model of the differential robot.
  • the analysis of the differential robot kinematics model needs to assume that the robot does not slip during the motion process. At this time, the wheel motion is pure rolling without slipping.
  • the robot kinematics model can be expressed by velocity and angular velocity, such as formula 3.
  • represents the direction angle of the grinding and polishing robot in the global coordinates
  • v represents the velocity component in the forward direction generated by the driving wheels (unit: m/s)
  • w represents the angular velocity generated by the two driving wheels (unit: rad/s ).
  • w represents the rotational angular velocity of the robot
  • v represents the velocity component in the forward direction generated by the driving wheel
  • represents the direction angle of the grinding and polishing robot in the global coordinates
  • represents the angle between the force direction and the motion direction of the floor grinding and polishing robot
  • F represents the force from the ground on the grinding disc
  • J represents the moment of inertia of the floor grinding and polishing robot
  • m represents the mass of the floor grinding and polishing robot
  • L is the leading distance.
  • this embodiment proposes a trajectory correction method based on the error amount.
  • the trajectory correction method mainly includes robot positioning, the calculation method of the leading point error, the deviation amount and Algorithm for solving control commands.
  • AMCL Adaptive Monte Carlo Localization
  • Prediction stage set the particle parameter N, and the parameter size is set according to the area of the environment map; randomly scatter particles, and randomly generate N particles according to the robot kinematics model and prior probability distribution; the weight of each particle at the initial moment is as follows:
  • the measurement stage is as follows: calculate and generate the particle pose at the next moment according to the particle pose information and the kinematic model at the previous moment, traverse each particle to calculate the particle pose at the next moment;
  • the relationship between the posterior probability density function calculated by the Yeesian probability distribution, and the weight of the particles calculated by using the measurement data is shown in formula (5).
  • z 1:t ,u 1:t ) represents the posterior probability
  • z 1:t ,u 1:t ) represents the proposal distribution.
  • x t k represents the set of N particles, the superscript k represents the kth particle in the set, and the subscript t refers to the time;
  • x t ) is the observation model, which means when the mobile robot attitude information x t When known, the probability of observing z t ;
  • x t-1 ,u t ) is the motion model, which represents the transition probability between different states of the mobile robot under the action of control input information, x t-1 is the pose of the robot at the last moment, u t represents the current control vector, which is described as the posterior probability in Bayesian theory;
  • x t-1 ,u t ) in the denominator is p The theoretical value of (x t
  • the re-sampling stage is: choose to keep or discard the particle according to the size of w t k , discard the particles with small weight, keep the particles with high weight, and add random particles to avoid the particle kidnapping problem and improve the robustness of the algorithm.
  • the final particles are concentrated in a region, which is the coordinate P r (x r , y r , ⁇ r ) of the robot at this time.
  • the adaptive Monte Carlo algorithm is a method of relative positioning. Using lidar data, iteratively updates the position and pose, effectively avoiding the situation of positioning error accumulation and positioning failure caused by the shaking and jumping of the grinding and polishing robot. Under normal circumstances, when the robot generates displacement, the algorithm superimposes the kinematics model on the basis of the original distribution to update the particle pose. In the event of a jump, the algorithm redistributes the particles, starts a new round of iterative calculations, and finally accurately represents the real coordinates of the robot. Therefore, the previous positioning results will not affect the positioning after the jump, and will not cause error accumulation.
  • the jumping situation of the robot is more complicated. Due to the uncertainty of the direction and magnitude of the force, there are many possible jumping situations, such as forward jumping, backward jumping, and sideways jumping, etc. .
  • the method of leading point control is used.
  • the lead point refers to the corresponding point on the path ahead of the robot by a fixed distance.
  • the deviation between the robot and the leading point is calculated by AMCL to locate P n (x n , y n , ⁇ n ) and the robot trajectory leading point P t (x t , y t , ⁇ t ).
  • the deviation value can be guaranteed to be positive. At this time, the continuity of the robot's operation is guaranteed, and the robustness of the control is also guaranteed.
  • the correction of the offset is actually to convert the offset into the control command of the robot.
  • the distance and angle controllers are designed in combination with the classic PID algorithm, such as formula (10).
  • the angle PID controller controls the heading angle of the robot, and the distance PID controller outputs the robot speed command. This control method controls the speed and angle separately, and can quickly correct errors when errors occur, and can more flexibly deal with deviations in different situations.
  • the angle offset e ⁇ and the distance offsets e x and e y in the X-axis and Y-axis directions are respectively brought into the formula (10) to obtain two sets of PID outputs;
  • u(t) is the deviation correction amount
  • k P is the proportional coefficient
  • k I is the integral coefficient
  • k D is the differential coefficient, when the input angle deviation e ⁇ is output as the angle control amount, when the input is the distance offset
  • the output is the speed control value.
  • the error calculation method of the leading point helps to ensure the smoothness of the running trajectory, and the PID algorithm quickly tracks the error amount.
  • the two algorithms ensure the smoothness of trajectory tracking and the rapidity of error tracking during the trajectory correction process of the robot.
  • the trajectory correction experiment is carried out in the space where the Vicon optical trajectory capture system is installed to realize and record the trajectory of the robot.
  • the experimental equipment includes the Vicon optical trajectory capture system and the floor grinding and polishing robot platform. Among them, the use of 7 Vicon optical capture lenses can capture and record the trajectory of optical markers in space in real time.
  • the optical reflective ball is used to mark the robot, and the Vicon lens captures the optical reflective ball and establishes a corresponding rigid body of the robot, which reflects the posture of the robot through the rigid body.
  • the position data captured by the 7 capture cameras is aggregated into the Tracker through Vicon’s own switch. The Tracker will process and visualize the data of each camera, share the data through the LAN, and finally analyze and process it through Matlab and Numpy.
  • the basic parameter settings of the trajectory self-correction experiment are shown in Table 1.
  • the Vicon optical lens has a resolution of 1.3 million and a frequency of 120Hz, which can capture the trajectory of a high-speed moving target.
  • the rated speed of the servo motor of the floor grinding and polishing machine is 3000r/min, the maximum linear speed is 1m/s per second, the maximum angular speed is 1rad/s per second, and the rotational speed of the grinding disc is 2700rad/s per minute.
  • the effective scanning range is 0.1-30m
  • the distance resolution is 0.001m
  • the effective scanning angle is 270°
  • the angular resolution is 0.25°.
  • the parameter settings in the experiment are shown in Table 2.
  • the maximum speed of the robot is set to 0.3m/s, the distance to the leading point of the robot is 0.3m, the maximum angular velocity of the robot is 0.25rad/s, and related PID parameters.
  • the jump and angle mutation are in a small range, about in the angle range of (10, -10), and the lateral jump is less than 10cm.
  • two sets of large-scale disturbance experiments were carried out by artificially simulating the force of the robot.
  • the correction effect of the robot when there was a lateral jump was tested.
  • the robot was pushed laterally at the starting point of 0.25m. , generating a lateral force, causing the robot to generate a lateral jumping displacement, which is calculated to be 22cm.
  • the second test is the trajectory correction effect of the robot when the angle deviation occurs. An external force is applied at the starting point of the robot at 0.5m to make the robot rotate rigidly. After calculating the angle deviation of 15 degrees, the trajectory self-correction ability is tested. The experimental results are shown in Figure 6 shown.
  • the robot can complete the correction of the trajectory after two disturbances, showing a good trajectory self-correction ability, and can correct the situation of large angular deviation and lateral jump.
  • the robot is basically corrected after straight line correction and right-angle turning.
  • the error of the trajectory is small, and the trajectory of the robot is close to the undisturbed trajectory.
  • Near the second corner (0.237, -0.05104), due to the unfinished correction of the robot heading angle, the deviation tends to increase at this time.
  • the deviation gradually decreases, and after a straight line correction of 1m, the robot returns to the trajectory, and the correction is completed at (-1.557, -0.163).
  • the error approaches zero, and the subsequent trajectory coincides with the undisturbed experimental trajectory.
  • the trajectory tracking evaluation metric is expressed in terms of robot trajectory deviation.
  • Trajectory deviation refers to the degree of deviation between two trajectories.
  • the first undisturbed trajectory is used as the true value of the trajectory, and the Euclidean distance formula (11) between the second trajectory and the true value is expressed.
  • the experimental results show that the deviation of the undisturbed experiment is less than 0.025m.
  • the trajectory error continues to increase.
  • the AMCL positioning algorithm is in the iterative stage, and the robot pose has not yet been accurately identified.
  • the increasing speed of the error decreased rapidly.
  • the trajectory was corrected.
  • the maximum error reached 0.34m, and then the error decreased rapidly.
  • the robot has been accurately positioned and quickly corrected.
  • the robot quickly locates the deviation and corrects the trajectory, and the error keeps getting smaller. After the robot is disturbed, the error is corrected quickly, and the final error is adjusted within a small range.
  • the mean value of the steady-state error is 0.0096m, which comes from the instability of the equipment.
  • the maximum deviation of the robot is 0.1788m.
  • the steady-state error of the robot is about 0.0110m.
  • the maximum deviation of the robot is about 0.3464m.
  • the correction effect is obvious.
  • Figure 8 shows the working trajectory of the floor grinding and polishing robot at a long distance (42 meters).
  • the trajectory deviation occurs, the robot can immediately correct the pose, and the overall trajectory effect is better and the accuracy is higher. Therefore, the trajectory self-correction algorithm proposed in this embodiment can well solve the problems in the actual work of the autonomously navigating floor grinding and polishing robot.
  • This embodiment proposes a trajectory correction method based on the amount of error for the problem of trajectory deviation caused by vibration and jumping during the autonomous navigation process of the floor grinding and polishing robot. Solve the problem that the robot shakes due to uneven ground, and the jumping deviates from the track to a large extent, and then realizes the precise control of the autonomous navigation of the floor grinding and polishing robot. In order to verify the algorithm, this embodiment uses the Vicon optical capture system to conduct experiments on the robot's 22cm lateral jump and 15-degree large angle deviation. Finally, after a 2.5m distance correction, the trajectory deviation is less than 0.03m, which belongs to the normal range. In long-distance actual scenarios, the robot can also better deal with the problem of trajectory deviation. Therefore, the method provided in this embodiment can correct the trajectory deviation during the autonomous navigation process of the floor grinding and polishing robot, and has high navigation accuracy.
  • the present application also provides a device corresponding to the method in Embodiment 1, see Embodiment 2 for details.
  • an error-correcting floor grinding and polishing robot trajectory correction device including: an initialization module, a pose update module, and a motion control module;
  • the initialization module is used to obtain the ideal trajectory covered by the robot, and the point on the trajectory with a distance of L directly in front of the robot is set as the trajectory leading point of the robot; the motion control model of the floor grinding and polishing robot is established;
  • the pose update module is used to obtain the motion state of the robot in real time during the movement of the robot along the path, and then update the pose of the robot through an adaptive Monte Carlo algorithm;
  • the motion control module is used to calculate the deviation between the current pose of the robot and the leading point of the trajectory, and then convert the deviation into a control instruction of the robot according to the motion control model, and control the movement of the robot to obtain a new pose, and then Returns the pose update module.
  • the motion control model when applied to a floor grinding and polishing robot with a two-wheel differential structure chassis, the motion control model is specifically:
  • w represents the rotational angular velocity of the robot
  • v represents the velocity component in the forward direction generated by the driving wheel
  • represents the direction angle of the grinding and polishing robot in the global coordinates
  • represents the angle between the force direction and the motion direction of the floor grinding and polishing robot
  • F represents the force from the ground on the grinding disc
  • J represents the moment of inertia of the floor grinding and polishing robot
  • m represents the mass of the floor grinding and polishing robot
  • L is the leading distance.
  • e x represents the distance deviation in the X direction
  • e y represents the distance deviation in the Y direction
  • e ⁇ represents the angle deviation
  • P n (x n ,y n , ⁇ n ) is the current pose of the robot
  • P t (xt,yt, ⁇ t ) is the leading point of the trajectory.
  • the deviation is converted into robot control instructions, specifically:
  • the angle offset e ⁇ and the distance offsets e x and e y in the X-axis and Y-axis directions are respectively brought into the formula to obtain two sets of PID outputs;
  • u(t) is the deviation correction amount
  • k P is the proportional coefficient
  • k I is the integral coefficient
  • k D is the differential coefficient, when the input angle deviation e ⁇ is output as the angle control amount, when the input is the distance offset
  • the output is the speed control value.
  • the pose update module is specifically: when the robot is performing normal displacement, the adaptive Monte Carlo algorithm superimposes the kinematics model on the basis of the original distribution to update the particle pose; when the robot jumps, the adaptive Monte Carlo algorithm The Luo algorithm redistributes the particles, starts a new round of iterative calculations, and finally obtains a result that accurately represents the real coordinates of the robot.
  • Embodiment 2 of the present invention is the device used to implement the method in Embodiment 1 of the present invention, so based on the method described in Embodiment 1 of the present invention, those skilled in the art can understand the specific structure and deformation of the device , so it will not be repeated here. All devices used in the method of Embodiment 1 of the present invention belong to the intended protection scope of the present invention.

Landscapes

  • Engineering & Computer Science (AREA)
  • Robotics (AREA)
  • Mechanical Engineering (AREA)
  • Manipulator (AREA)

Abstract

一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置,涉及机器人控制技术领域。通过自适应蒙特卡罗算法实时获取机器人位态,根据当前位姿与轨迹超前点求取偏差量,然后将偏差量解算为机器人运动控制指令,最后定位算法获取修正后的位姿,重新计算误差和控制量,形成闭环控制。实验结果表明,基于该控制系统的地坪磨抛机器人能够应对较大的轨迹偏离情况,在处理[0,15]度范围内的角度偏差和[0,22]厘米范围内的横向偏离的情况下,能够快速修正偏移量,保证导航精度。

Description

一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置 技术领域
本发明涉及机器人控制技术领域,特别涉及一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置。
背景技术
地坪磨抛机器人是一种用于地面打磨和抛光的设备,主要应用于混凝土、人造石、花岗岩、环氧地面的处理,通过高速转动的磨盘打磨地面使地面平整光滑,是地坪工程处理的主流设备。因为打磨地面平整度不一致导致打磨过程中机器人导航精度降低;地面凹陷、突起、水渍等摩擦力不一致的因素导致机器人产生跳动,主要表现为航向角偏离和横向侧滑,对机器人高精度路径导航、自主偏差轨迹纠正提出了新的挑战,研究其轨迹矫正自校正算法是提升自主导航地坪磨抛机器人导航精度的关键之一。
由于地面的情况复杂,外界干扰种类多,机器人实际的轨迹偏差复杂多样,因此很难确定精确的机器人数学模型,利用传统的控制理论难以应对实际机器人移动过程中的轨迹纠偏。因此,前人提出多种解决方案用于解决机器人移动过程中的轨迹偏离问题。潘世举等人提出一种基于线性时变模型预测控制的控制策略,与普通的MPC算法对比,通过仿真和实车实验证明该算法的轨迹跟踪误差在理想范围内,缺点是没有充分考虑机器人实时速度的变化,与实际运动情况存在偏差。黄刚提出一种实时修正机器人偏差的方法,并结合粒子群轨迹规划算法应用到实际的麦科勒姆轮机器人上,实现机器人快速,有效的轨迹纠偏,能够处理较小的偏差情况,美中不足的是该实验所处理的轨迹偏差值较小。S.Mata、Li S E等人将模型预测控制用于实际场合,考虑实际车辆运行中的情况设置控制器,具有较好的控制效果,缺点是由于车辆的运动学模型差异每次都需要重新设计控制模型。
发明内容
本发明要解决的技术问题,在于提供一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置,实现快速修正偏移量,保证导航精度。
第一方面,本发明提供了一种误差矫正的地坪磨抛机器人轨迹纠偏方法,包括:
步骤10、获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
步骤20、在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
步骤30、计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回步骤20。
进一步地,所述步骤10中,当应用于两轮差速结构底盘的地坪磨抛机器人时,运动控制模型具体为:
Figure PCTCN2022132273-appb-000001
其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量,L为超前距离。
进一步地,所述步骤30中,计算机器人当前位姿与轨迹超前点之间的偏差量,具体为:
e x=x t-x n
e y=y t-y n
Figure PCTCN2022132273-appb-000002
其中,e x代表X方向距离偏差,e y代表Y方向距离偏差,e θ代表角度偏差,P n(x n,y nn)为机器人当前位姿,P t(x t,y tt)为轨迹超前点。
进一步地,所述步骤30中,将偏差量转化为机器人的控制指令,具体为:
根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式,得到两组PID输出;
Figure PCTCN2022132273-appb-000003
其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
进一步地,所述步骤20具体为:在机器人进行正常位移时,自适应蒙特卡洛算法在原有分布的基础上叠加运动学模型更新粒子位姿;在机器人发生跳机的情况下,自适应蒙特卡洛算法重新分布粒子,开始全新一轮的迭代计算,最终得到准确表示机器人真实坐标的结果。
第二方面,本发明提供了一种误差矫正的地坪磨抛机器人轨迹纠偏装置,包括:初始化模块、位姿更新模块以及运动控制模块;
所述初始化模块,用于获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
所述位姿更新模块,用于在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
所述运动控制模块,用于计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回位姿更新模块。
进一步地,所述初始化模块中,当应用于两轮差速结构底盘的地坪磨抛机器人时,运动控制模型具体为:
Figure PCTCN2022132273-appb-000004
其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量,L为超前距离。
进一步地,所述运动控制模块中,计算机器人当前位姿与轨迹超前点之间的偏差量,具体为:
e x=x t-x n
e y=y t-y n
Figure PCTCN2022132273-appb-000005
其中,e x代表X方向距离偏差,e y代表Y方向距离偏差,e θ代表角度偏差,P n(x n,y nn)为机器人当前位姿,P t(x t,y tt)为轨迹超前点。
进一步地,所述运动控制模块中,将偏差量转化为机器人的控制指令,具体为:
根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式,得到两组PID输出;
Figure PCTCN2022132273-appb-000006
其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
进一步地,所述位姿更新模块具体为:在机器人进行正常位移时,自适应蒙特卡洛算法在原有分布的基础上叠加运动学模型更新粒子位姿;在机器人发生跳机的情况下,自适应蒙特卡洛算法重新分布粒子,开始全新一轮的迭代计算,最终得到准确表示机器人真实坐标的结果。
本发明实施例中提供的技术方案具有如下技术效果或优点:
本发明实施例采用超前点控制的方法能够保证机器人的轨迹偏差为正,机器人一边进行矫正一边沿着轨迹运行,接着通过自适应蒙特卡罗算法实时获取机器人位态,根据当前位姿与轨迹超前点求取偏差量,然后将偏差量解算为机器人运动控制指令,最后定位算法获取修正后的位姿,重新计算误差和控制量,形成闭环控制。本发明实施例提出的轨迹纠偏方法能够应对较大程度的偏移量,有效解决了地坪磨抛机器人的轨迹偏离问题。
上述说明仅是本发明技术方案的概述,为了能够更清楚了解本发明的技术手段,而可依照说明书的内容予以实施,并且为了让本发明的上述和其它目的、特征和优点能够更明显易懂,以下特举本发明的具体实施方式。
附图说明
下面参照附图结合实施例对本发明作进一步的说明。
图1为本发明实施例一中方法的流程图;
图2为本发明实施例一中地坪磨抛机器人控制系统流程图;
图3为本发明实施例一中磨抛机器人运动学示意图;
图4为本发明实施例一中偏差量计算示意图;
图5为本发明实施例一中两次无扰动实验轨迹示意图;
图6为本发明实施例一中扰动实验轨迹示意图;
图7为本发明实施例一中相对实验偏差示意图;
图8为本发明实施例一中两次干扰实验绝对偏差示意图;
图9为本发明实施例二中装置的结构示意图。
具体实施方式
本申请实施例通过提供一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置,实现快速修正偏移量,保证导航精度。
本发明实施例中的技术方案,总体思路如下:
本发明针对地坪磨抛机器人自主导航过程中抖动和跳机产生轨迹偏差的问题,提出一种基于误差量的轨迹矫正方法,解决由于地面不均匀导致机器人抖动,跳动出现大程度偏离轨迹的问题,进而实现地坪磨抛机器人的自主导航精确控制。
首先规划地坪磨抛机器人覆盖的理想轨迹并设定轨迹超前点。然后,根据机器人当前位姿选择理想轨迹点作为跟踪目标点,通过自适应蒙特卡洛算法(Adaptive Deterministic Monte Carlo,AMCL)实时获取机器人位置和姿态,从而计算目标点与机器人当前位置存在的偏差,偏差量经过距离、角度两个PID控制器解算得到电机的控制指令,控制机器人运动得到新的位姿。不断循环控制机器人循迹纠偏,实现定位到矫正的闭环系统。
为了精准的控制机器人,纠正机器人跳机、抖动时导致轨迹偏移轨迹,本发明实施例提出一种基于误差量的轨迹纠偏方法,轨迹纠偏方法主要包括机器人定位、超前点误差计算方法、偏差量与控制指令的解算算法。
实施例一
本实施例提供一种误差矫正的地坪磨抛机器人轨迹纠偏方法,如图1所示,包括:
步骤10、获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
步骤20、在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
步骤30、计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回步骤20。
通过超前点控制的方法能够保证机器人的轨迹偏差为正,机器人一边进行矫正一边沿着轨迹运行,接着通过自适应蒙特卡罗算法实时获取机器人位态,根据当前位姿与轨 迹超前点求取偏差量,然后将偏差量解算为机器人运动控制指令,最后定位算法获取修正后的位姿,重新计算误差和控制量,形成闭环控制。
本发明的方法可以适用于所有轮式结构的地坪磨抛机器人,图2是地坪磨抛机器人的控制系统流程图。首先规划地坪磨抛机器人覆盖的理想轨迹。然后,根据机器人当前位姿选择理想轨迹点作为跟踪目标点,通过自适应蒙特卡洛算法(Adaptive Deterministic Monte Carlo,AMCL)实时获取机器人位置和姿态,从而计算目标点与机器人当前位置存在的偏差,偏差量经过距离、角度两个PID控制器解算得到电机的控制指令,控制机器人运动得到新的位姿。不断循环控制机器人循迹纠偏,实现定位到矫正的闭环系统。
作为本发明的一种具体实现方式,以采用两轮差速结构底盘的地坪磨抛机器人为对象,两轮差速结构底盘包含公转的大磨盘和自转的小磨盘。其中,通过自转磨盘的相对转动平均来自地面的摩擦受力,而大磨盘的公转可以使受力出现周期性变化,减小受力不均匀的影响。
1、地坪磨抛机器人运动控制模型
为了分析磨抛机器人在磨抛地面时的受力情况,搭建了机器人在磨抛运动过程中的运动控制模型。磨抛机器人某一时刻,以机器人两轮中心为原点建立机器人坐标系x c-y c,绝对坐标系X-Y。如图3所示,其中θ为Y和y c的夹角,机器人在全局坐标系中的姿态可表示为(x,y,θ)。对机器人受力状态展开分析,运动过程中的受力包括磨盘受力和两个驱动轮的动力。F表示磨盘受到的来自地面的力,F的大小和方向随着磨盘的转动不断发生变化,F x表示F垂直机器人运动方向的分量,F y表示F沿着机器人运动方向的分量。
F x作用点与机器人的转向中心距离为L,根据刚体转动定律,受力造成机器人发生刚体转动,如公式2所示。平行于机器人运动方向的受力应用牛顿第二定律公式推导,F y产生机器人沿着机器人方向的位移动作,如公式3所示。两个力的作用效果相互叠加出现机器人发生角度改变和沿着角度方向的跳动位移。
Jω′=Fsinα*L      (1)
Figure PCTCN2022132273-appb-000007
其中,w表示机器人的转动角速度,v y表示机器人前进方向的瞬时速度,α表示地坪磨抛机器人受力方向与运动方向的夹角,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量。
磨抛机器人的运动控制模型由磨盘动力学模型叠加差速机器人运动学模型组成。差速机器人运动学模型分析需假定机器人在运动过程中不发生侧滑,此时轮子运动为纯滚动无滑动的情况,机器人运动学模型可以用速度和角速度表示,如公式3。
Figure PCTCN2022132273-appb-000008
其中,θ表示磨抛机器人在全局坐标下的方向角度,v表示由驱动轮产生的前进方向速度分量(单位:m/s),w表示由两驱动轮产生的角速度度(单位:rad/s)。
综上分析,通过两轮差速模型的动力学模型公式(1)(2)叠加磨盘受力的运动学模 型公式(3),得到地坪磨抛机器人的运动控制模型公式(4)。
Figure PCTCN2022132273-appb-000009
其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量,L为超前距离。
2、轨迹纠偏算法
为了精准的控制机器人,纠正机器人跳机、抖动时导致轨迹偏移轨迹,本实施例提出一种基于误差量的轨迹纠偏方法,轨迹纠偏方法主要包括机器人定位、超前点误差计算方法、偏差量与控制指令的解算算法。
2.1自适应蒙特卡洛定位
在沿着路径运动过程中,由于地面均匀度不同,机器人自身抖动、跳动等因素,对机器人定位提出了新的挑战。传统的绝对定位方案在长距离下表现了较差的鲁棒性,如里程计时常出现信号飘移、IMU产生累积误差,因此采用自适应蒙特卡洛方法(Adaptive Monte Carlo Localization,AMCL)。AMCL是应用广泛的激光雷达相对定位方法,分为预测阶段、测量阶段和重采样阶段,通过迭代更新粒子的方式得到机器人的准确位姿。
预测阶段:设置粒子参数N,参数大小根据环境地图面积设定;随机散布粒子,根据机器人运动学模型和先验概率分布,随机生成N个粒子;初始时刻每一个粒子的权重如下:
Figure PCTCN2022132273-appb-000010
所述测量阶段为:根据上一时刻粒子姿态信息和运动学模型推算产生下一时刻粒子的位姿,遍历每个粒子计算下一时刻的粒子位姿;更新粒子权重,根据建议分布函数与贝叶斯概率分布计算的后验概率密度函数的关系,利用测量数据计算粒子的权重如公式(5)。其中,p(x k 0:t|z 1:t,u 1:t)表示后验概率,q(x k 0:t|z 1:t,u 1:t)表示建议分布。
Figure PCTCN2022132273-appb-000011
其中,x t k表示N个粒子的集合,上标k表示集合中的第k个粒子,下标t指时刻;p(z t|x t)是观测模型,表示当移动机器人姿态信息x t已知时,观测到z t的概率;p(x t|x t-1,u t)是运动模型,表示移动机器人在控制输入信息的作用下不同状态之间的转移概率,x t-1是机器人上一时刻的位姿,u t表示当前的控制向量,在贝叶斯理论中将这一部分描述为后验概率;分母中的q(x t|x t-1,u t)是p(x t|x t-1,u t)的理论值。
所述重采样阶段为:根据w t k的大小来选择保留或者舍弃该粒子,丢弃权重小的粒子,保留权重高的粒子,并且加入随机粒子来规避粒子绑架问题,提高算法鲁棒性。经过迭代,最终粒子集中在一个区域,这个区域即机器人此时的坐标P r(x r,y rr)。
自适应蒙特卡洛算法是一种相对定位的方法,利用激光雷达数据,迭代更新位姿有效避免了磨抛机器人抖动、跳机导致的定位误差累加、定位失灵的情况。正常情况下,机 器人产生位移时,算法在原有分布的基础上叠加运动学模型更新粒子位姿。在发生跳机的情况下,算法重新分布粒子,开始全新一轮的迭代计算,最终准确表示机器人真实坐标,因此之前的定位结果不会对跳机之后的定位产生影响,不会造成误差累加。
2.2偏差量获取
在沿着路径运动过程中,由于机器人打磨地面造成的抖动、跳动等问题,出现实际运行轨迹偏离理想轨迹的情况。不加矫正会造成后续轨迹完全偏离,导致出现更加严重的生产事故。机器人出现跳动的情况比较复杂,由于其受力方向和大小的不确定性,导致其可能发生的跳动情况比较多,可能出现前向跳机,后向跳机,侧向跳机等多种情况。为了保证在出现跳机的同时能够继续控制机器人继续沿着轨迹运行,不出现原地矫正或倒车的情况,保证控制的连续性和路径的平滑性,使用超前点控制的方法。超前点是指超前于机器人一个固定距离的路径对应点。将轨迹上机器人正前方距离为L的点设置为机器人的跟踪点,从而保证机器人跟踪点与定位点之间的误差值始终为正,能够控制机器人矫正过程中继续朝着超前点移动。
机器人跳机的情况复杂,其中前向跳动和后向跳动的误差较为简单,最为复杂的是发生侧向跳机的情况,如图4所示。发生侧向跳机时,机器人的坐标由P r(x r,y rr)突变为P n(x n,y nn)。此时,传统的矫正方法机器人会发生原地转向调整,造成了轨迹的断续。采用超前点控制的方法能够保证机器人的轨迹偏差为正,机器人一边进行矫正一边沿着轨迹运行。此时机器人与超前点的偏差由AMCL计算定位P n(x n,y nn)和机器人轨迹超前点P t(x t,y tt)。用(e x,e y,e θ)表示机器人位置与超前点的偏差。其中:包括X方向距离偏差e x、Y方向距离偏差e y,以及角度偏差e θ
e x=x t-x n     (7)
e y=y t-y n     (8)
Figure PCTCN2022132273-appb-000012
使用当前位置与超前点的偏差计算方式,不论是出现哪种跳机工况的都能够保证偏差值为正,此时既保证了机器人运行的连续性,又保证了控制的鲁棒性。
2.3偏移量修正
偏移量的修正实际是将偏差量转化为机器人的控制指令,本实施例结合经典PID算法设计距离、角度控制器,如公式(10)。角度PID控制器进行机器人航向角的控制,距离PID控制器输出机器人速度指令。该控制方法将速度与角度分别控制,在误差出现时可以快速矫正,能够更加灵活的应对不同情况下的偏差。
根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式(10),得到两组PID输出;
Figure PCTCN2022132273-appb-000013
其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
超前点的误差计算方法有助于保证运行轨迹的平滑性,PID算法快速跟踪误差量, 两种算法保证了机器人在轨迹矫正的过程中,保证轨迹跟踪的平滑性、和误差跟踪的快速性。
3、实验与结果分析
轨迹矫正实验是在安装Vicon光学轨迹捕捉系统的空间下进行,实现并记录机器人的移动轨迹。实验设备包含Vicon光学轨迹捕捉系统和地坪磨抛机器人平台。其中,使用7个Vicon光学捕捉镜头能够实时捕捉、记录空间中光学标记物的轨迹。光学反光球用于标记机器人,Vicon镜头捕捉光学反光球并建立对应机器人刚体,通过刚体反应机器人姿态。7个捕捉摄像机捕捉到的位置数据通过Vicon自身的交换机汇总到Tracker中,Tracker会对每个摄像机的数据处理然后可视化,并通过局域网共享数据,最终经过Matlab、Numpy进行分析处理。
轨迹自校正实验的基本参数设置如表1所示,其中Vicon光学镜头分辨率130万,频率120Hz,能够捕捉高速移动目标的移动轨迹。地坪磨抛机器伺服电机额定转速3000r/min,最大线速度为每秒1m/s,最大角速度每秒1rad/s,磨盘转速每分钟2700rad/s。使用北阳激光雷达UTM-30LX,有效扫描范围0.1-30m,距离分辨率0.001m,有效扫描角度270°,角度分辨率0.25°。
表1机器人和Vicon基本参数设置
Figure PCTCN2022132273-appb-000014
3.1无扰动真值轨迹实验
进行两组无扰动误差实验,并以第一次无扰动实验作为轨迹真值,后续实验对照均以第一组无扰动实验为基础。实验中参数设置如表2所示,设置机器人最大速度0.3m/s,机器人超前点距离为0.3m,机器人最大角速度0.25rad/s,以及相关PID参数。
表2机器人轨迹跟踪参数设置
Figure PCTCN2022132273-appb-000015
分别在相同实验环境下进行两次正常工况下的地坪磨抛机器人轨迹实验,测量实 验设备的误差。其中,U字形轨迹横向位移2m、纵向位移1m,记录实验轨迹如图5,机器人出发点(-1.472,-1.213),终点(-1.618,-0.201)。实验结果可以看出,在没有扰动的情况下,两次实验的轨迹基本重合,在拐角处出现较大偏离,原因是磨抛机器人体积庞大,且转弯中心和磨盘受力点不在同一点上,属于正常现象。此时两条轨迹的偏差平均值作为对照值。
3.2扰动实验
地坪磨抛机器人在生产过程中,产生的跳动和角度突变处于一个较小的范围内,大约在(10,-10)的角度范围内,横向跳机小于10cm。为了测试极端情况下的轨迹矫正效果,通过人为模拟机器人受力进行两组大程度的扰动实验,第一次测试机器人在出现横向跳动的时候的矫正效果,实验中在出发0.25m处横向推动机器人,产生一个横向作用力,使机器人产生横向跳动位移,经过计算位移为22cm。第二次测试机器人在产生角度偏离时的轨迹矫正效果,在机器人出发0.5m处施加一个外力使机器人产生刚体转动,经过计算该角度偏差15度,测试其轨迹自校正能力,实验结果如图6所示。
通过实验分析可以得到,两次扰动最终机器人都能完成轨迹的矫正,表现出较好的轨迹自校正能力,能够纠正大角度偏差和横向跳动的情况。机器人在经过直线矫正和直角转弯后基本矫正完成,此时轨迹的误差较小,机器人轨迹与无扰动轨迹贴近。在第二个拐角(0.237,-0.05104)附近由于机器人航向角未完成矫正,此时偏差增大的趋势。转弯完成后偏差逐渐减小,再经过1m的直线矫正,机器人回归轨迹,到达(-1.557,-0.163)处矫正完成,此时误差趋近于为零,后续轨迹与无扰动实验轨迹重合。
3.3评价指标
轨迹跟踪评估指标用机器人轨迹偏差表示。轨迹偏差指的是两条轨迹的偏离度,计算轨迹之间的偏离程度,以第一次无扰动轨迹作为轨迹真值,第二条轨迹与真值之间的欧式距离公式(11)表示。
Figure PCTCN2022132273-appb-000016
将第一次无扰动实验作轨迹真值,求出后续三组实验对其轨迹的偏差如图7所示,实线是添加横向22cm跳动时的误差情况,点划线表示添加15度偏差时的轨迹误差情况,虚线表示第二次无扰动实验的误差情况。
实验结果可见,无扰动实验的偏差小于0.025m。在添加扰动的一段时间内,轨迹误差持续增大,此时由于误差较大,AMCL定位算法处于迭代阶段,尚未准确识别机器人位姿。后误差增加的速度快速降低,此时开始矫正轨迹,误差最大时达到0.34m,之后误差快速降低,此时机器人已经准确定位且快速矫正。当添加横向移动偏差时,机器人快速定位偏差并矫正轨迹,误差不断较小。机器人经过扰动后快速进行误差矫正,最终误差在一个较小的范围内调整,在第二个拐角后快速较小误差,最终轨轨迹矫正完成。过程中机器人经过1.5m到达第一次拐角处时误差已经小于0.05m,后续出现波动。从误差开始到矫正结束总共经过2.5m的路程,最终误差处于约等于无扰动实验误差。取轨迹稳定后的500个误差数据,计算器矫正后稳态误差数据及整个过程中最大误差如表3给出。
表3实验误差
组别 稳态误差均值 稳态最小误差 稳态误差方差 实验最大误差
角度偏航(m) 0.0288 0.0003 0.0182 0.3464
横向跳机(m) 0.0110 0.0072 0.0044 0.1788
无扰动(m) 0.0096 0.0056 0.0012 0.0361
机器人无扰动试验下其稳态误差均值为0.0096m,该误差来源于设备的不稳定性。加入横向跳机扰动后,机器人最大偏差0.1788m经过2.5m的矫正后,机器人稳态误差约0.0110m,加入角度偏航后机器人最大偏差约0.3464m,机器人经过2.5m的矫正后,稳态误差约0.0288m,矫正效果明显。
实际工作中,在地坪磨抛机器人产生的跳动和角度突变一般处于一个较小的范围内,极少出现实验中设置的极端条件。图8为长距离下(42米)地坪磨抛机器人工作轨迹,当产生轨迹偏差时,机器人可以即时矫正位姿,整体轨迹效果较好、精度较高。因此,本实施例提出的轨迹自校正算法能够很好的解决自主导航地坪磨抛机器人实际工作中的问题。
本实施例针对地坪磨抛机器人自主导航过程中抖动和跳机产生轨迹偏差的问题,提出一种基于误差量的轨迹矫正方法。解决由于地面不均匀导致机器人抖动,跳动出现大程度偏离轨迹的问题,进而实现地坪磨抛机器人的自主导航精确控制。为了验证算法,本实施例借助Vicon光学捕捉系统进行实验,分别对机器人22cm的横向跳动,15度大角度偏差进行实验,最终经过2.5m路程的矫正后轨迹偏差小于0.03m,属于正常范围。在长距离的实际场景中,机器人也能较好地应对轨迹偏离问题。因此,本实施例提供的方法能够矫正地坪磨抛机器人自主导航过程中的轨迹偏差,具有较高导航精度。
基于同一发明构思,本申请还提供了与实施例一中的方法对应的装置,详见实施例二。
实施例二
在本实施例中提供了一种误差矫正的地坪磨抛机器人轨迹纠偏装置,如图9所示,包括:初始化模块、位姿更新模块以及运动控制模块;
所述初始化模块,用于获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
所述位姿更新模块,用于在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
所述运动控制模块,用于计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回位姿更新模块。
本实施例的一种具体实现方式:
所述初始化模块中,当应用于两轮差速结构底盘的地坪磨抛机器人时,运动控制模型具体为:
Figure PCTCN2022132273-appb-000017
其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机 器人的质量,L为超前距离。
所述运动控制模块中,计算机器人当前位姿与轨迹超前点之间的偏差量,具体为:
e x=x t-x n
e y=y t-y n
Figure PCTCN2022132273-appb-000018
其中,e x代表X方向距离偏差,e y代表Y方向距离偏差,e θ代表角度偏差,P n(x n,y nn)为机器人当前位姿,P t(xt,yt,θ t)为轨迹超前点。
所述运动控制模块中,将偏差量转化为机器人的控制指令,具体为:
根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式,得到两组PID输出;
Figure PCTCN2022132273-appb-000019
其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
所述位姿更新模块具体为:在机器人进行正常位移时,自适应蒙特卡洛算法在原有分布的基础上叠加运动学模型更新粒子位姿;在机器人发生跳机的情况下,自适应蒙特卡洛算法重新分布粒子,开始全新一轮的迭代计算,最终得到准确表示机器人真实坐标的结果。
由于本发明实施例二所介绍的装置,为实施本发明实施例一的方法所采用的装置,故而基于本发明实施例一所介绍的方法,本领域所属人员能够了解该装置的具体结构及变形,故而在此不再赘述。凡是本发明实施例一的方法所采用的装置都属于本发明所欲保护的范围。
虽然以上描述了本发明的具体实施方式,但是熟悉本技术领域的技术人员应当理解,我们所描述的具体的实施例只是说明性的,而不是用于对本发明的范围的限定,熟悉本领域的技术人员在依照本发明的精神所作的等效的修饰以及变化,都应当涵盖在本发明的权利要求所保护的范围内。

Claims (10)

  1. 一种误差矫正的地坪磨抛机器人轨迹纠偏方法,其特征在,包括:
    步骤10、获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
    步骤20、在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
    步骤30、计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回步骤20。
  2. 根据权利要求1所述的方法,其特征在于:所述步骤10中,当应用于两轮差速结构底盘的地坪磨抛机器人时,运动控制模型具体为:
    Figure PCTCN2022132273-appb-100001
    其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量,L为超前距离。
  3. 根据权利要求2所述的方法,其特征在于:所述步骤30中,计算机器人当前位姿与轨迹超前点之间的偏差量,具体为:
    e x=x t-x n
    e y=y t-y n
    Figure PCTCN2022132273-appb-100002
    其中,e x代表X方向距离偏差,e y代表Y方向距离偏差,e θ代表角度偏差,P n(x n,y nn)为机器人当前位姿,P t(x t,y tt)为轨迹超前点。
  4. 根据权利要求2或3所述的方法,其特征在于:所述步骤30中,将偏差量转化为机器人的控制指令,具体为:
    根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式,得到两组PID输出;
    Figure PCTCN2022132273-appb-100003
    其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
  5. 根据权利要求1所述的方法,其特征在于:所述步骤20具体为:在机器人进行正常位移时,自适应蒙特卡洛算法在原有分布的基础上叠加运动学模型更新粒子位姿;在机器人发生跳机的情况下,自适应蒙特卡洛算法重新分布粒子,开始全新一轮的迭代计算,最终得到准确表示机器人真实坐标的结果。
  6. 一种误差矫正的地坪磨抛机器人轨迹纠偏装置,其特征在于,包括:初始化模块、位 姿更新模块以及运动控制模块;
    所述初始化模块,用于获取机器人覆盖的理想轨迹,将轨迹上机器人正前方距离为L的点设置为机器人的轨迹超前点;建立地坪磨抛机器人的运动控制模型;
    所述位姿更新模块,用于在机器人沿着路径运动过程中,实时获取机器人的运动状态,然后通过自适应蒙特卡洛算法更新机器人的位姿;
    所述运动控制模块,用于计算机器人当前位姿与轨迹超前点之间的偏差量,然后根据所述运动控制模型将偏差量转化为机器人的控制指令,控制机器人运动得到新的位姿,然后返回位姿更新模块。
  7. 根据权利要求6所述的装置,其特征在于:所述初始化模块中,当应用于两轮差速结构底盘的地坪磨抛机器人时,运动控制模型具体为:
    Figure PCTCN2022132273-appb-100004
    其中,w表示机器人的转动角速度,v表示由驱动轮产生的前进方向速度分量,θ表示磨抛机器人在全局坐标下的方向角度,α表示地坪磨抛机器人受力方向与运动方向的夹角,F表示磨盘受到的来自地面的力,J表示地坪磨抛机器人的转动惯量,m表示地坪磨抛机器人的质量,L为超前距离。
  8. 根据权利要求7所述的装置,其特征在于:所述运动控制模块中,计算机器人当前位姿与轨迹超前点之间的偏差量,具体为:
    e x=x t-x n
    e y=y t-y n
    Figure PCTCN2022132273-appb-100005
    其中,e x代表X方向距离偏差,e y代表Y方向距离偏差,e θ代表角度偏差,P n(x n,y nn)为机器人当前位姿,P t(x t,y tt)为轨迹超前点。
  9. 根据权利要求7或8所述的装置,其特征在于:所述运动控制模块中,将偏差量转化为机器人的控制指令,具体为:
    根据PID算法,将角度偏移量e θ以及X轴和Y轴方向的距离偏移量e x、e y分别带入公式,得到两组PID输出;
    Figure PCTCN2022132273-appb-100006
    其中,u(t)为偏差量修正量,k P为比例系数,k I为积分系数,k D为微分系数,当输入角度偏差e θ时输出为角度控制量,当输入为距离偏移量时输出为速度控制量。
  10. 根据权利要求6所述的装置,其特征在于:所述位姿更新模块具体为:在机器人进行正常位移时,自适应蒙特卡洛算法在原有分布的基础上叠加运动学模型更新粒子位姿;在机器人发生跳机的情况下,自适应蒙特卡洛算法重新分布粒子,开始全新一轮的迭代计算,最终得到准确表示机器人真实坐标的结果。
PCT/CN2022/132273 2021-11-24 2022-11-16 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置 WO2023093594A1 (zh)

Applications Claiming Priority (2)

Application Number Priority Date Filing Date Title
CN202111406310.XA CN114043479B (zh) 2021-11-24 2021-11-24 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置
CN202111406310.X 2021-11-24

Publications (1)

Publication Number Publication Date
WO2023093594A1 true WO2023093594A1 (zh) 2023-06-01

Family

ID=80210618

Family Applications (1)

Application Number Title Priority Date Filing Date
PCT/CN2022/132273 WO2023093594A1 (zh) 2021-11-24 2022-11-16 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置

Country Status (2)

Country Link
CN (1) CN114043479B (zh)
WO (1) WO2023093594A1 (zh)

Cited By (1)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN117922561A (zh) * 2023-12-29 2024-04-26 浙江中水数建科技有限公司 基于三维模型的智能碾压轨迹纠偏系统及方法

Families Citing this family (3)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN114043479B (zh) * 2021-11-24 2024-08-13 泉州装备制造研究所 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置
CN115014352B (zh) * 2022-06-01 2023-05-26 浙江大学 一种基于建议分布地图的室内全局定位方法
CN115990880A (zh) * 2023-01-04 2023-04-21 佛山市顺德区一拓电气有限公司 机器人航向调整方法、机器人、装置及计算机存储介质

Citations (5)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
RU2016114246A (ru) * 2016-04-12 2017-10-13 Федеральное государственное бюджетное учреждение науки Институт автоматики и процессов управления Дальневосточного отделения Российской академии наук (ИАПУ ДВО РАН) Способ автоматического формирования гладких траекторий движения мобильного робота в неизвестном окружении
CN111890350A (zh) * 2020-06-12 2020-11-06 深圳先进技术研究院 机器人及其控制方法、计算机可读存储介质
CN112356844A (zh) * 2020-11-19 2021-02-12 苏州智加科技有限公司 一种控制车辆行驶方向的方法、装置及设备
CN113211438A (zh) * 2021-05-08 2021-08-06 东方红卫星移动通信有限公司 基于预瞄距离自适应的轮式机器人控制方法及控制系统
CN114043479A (zh) * 2021-11-24 2022-02-15 泉州装备制造研究所 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置

Family Cites Families (4)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
JP3833567B2 (ja) * 2002-05-01 2006-10-11 本田技研工業株式会社 移動ロボットの姿勢制御装置
CN102699817B (zh) * 2012-06-01 2014-09-03 厦门大学 一种大口径非球面气囊抛光进动控制方法
CN110286683B (zh) * 2019-07-15 2020-07-24 北京科技大学 一种履带式移动机器人的自主行驶路径跟踪控制方法
CN113618743B (zh) * 2021-08-27 2022-08-23 北京航空航天大学杭州创新研究院 一种针对多源干扰的无人机机械臂末端位姿控制方法

Patent Citations (5)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
RU2016114246A (ru) * 2016-04-12 2017-10-13 Федеральное государственное бюджетное учреждение науки Институт автоматики и процессов управления Дальневосточного отделения Российской академии наук (ИАПУ ДВО РАН) Способ автоматического формирования гладких траекторий движения мобильного робота в неизвестном окружении
CN111890350A (zh) * 2020-06-12 2020-11-06 深圳先进技术研究院 机器人及其控制方法、计算机可读存储介质
CN112356844A (zh) * 2020-11-19 2021-02-12 苏州智加科技有限公司 一种控制车辆行驶方向的方法、装置及设备
CN113211438A (zh) * 2021-05-08 2021-08-06 东方红卫星移动通信有限公司 基于预瞄距离自适应的轮式机器人控制方法及控制系统
CN114043479A (zh) * 2021-11-24 2022-02-15 泉州装备制造研究所 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置

Non-Patent Citations (1)

* Cited by examiner, † Cited by third party
Title
CHEN HONGYU, PENG YANQING, DAI HOUDE, LIN MINGQIANG: "Research and Implementation of Trajectory Correction Algorithm for Floor Grinding Robot", MACHINE DESIGN & RESEARCH, vol. 38, no. 1, 20 February 2022 (2022-02-20), XP093068994, ISSN: 1006-2343, DOI: 10.13952/j.cnki.jofmdr.2022.0075 *

Cited By (1)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN117922561A (zh) * 2023-12-29 2024-04-26 浙江中水数建科技有限公司 基于三维模型的智能碾压轨迹纠偏系统及方法

Also Published As

Publication number Publication date
CN114043479A (zh) 2022-02-15
CN114043479B (zh) 2024-08-13

Similar Documents

Publication Publication Date Title
WO2023093594A1 (zh) 一种误差矫正的地坪磨抛机器人轨迹纠偏方法及装置
CN108673496B (zh) 一种基于纯追踪模型的工业机器人路径跟踪方法
US11230001B2 (en) Biped robot gait control method and biped robot
CN111739063A (zh) 一种基于多传感器融合的电力巡检机器人定位方法
CN109960150B (zh) 巡检机器人轨迹跟踪控制方法
CN110955262B (zh) 光伏组件清洁机器人的路径规划与跟踪的控制方法及系统
WO2019037618A1 (zh) 基于轨迹规划的车辆运动控制方法、装置及相关设备
Shen et al. Research and implementation of SLAM based on LIDAR for four-wheeled mobile robot
US11685049B2 (en) Robot localization using variance sampling
CN110837257A (zh) 一种基于iGPS与视觉的AGV复合定位导航系统
CN114442491A (zh) 室内机器人的局部路径规划和跟踪控制方法、装置及介质
CN107121128B (zh) 一种足式机器人地形参数的测量方法及系统
Wang et al. Vision-based tracking control of nonholonomic mobile robots without position measurement
Shi et al. Integrated Navigation by a Greenhouse Robot Based on an Odometer/Lidar.
Zhao et al. IRobot self-localization using EKF
Che et al. A wall-following navigation method for autonomous driving based on Lidar in tunnel scenes
Juntao et al. Research of AGV positioning based on the two-dimensional Code Recognition Method
CN117249817A (zh) 野外环境下管道巡检机器人轻量化自主导航系统及方法
CN115562304A (zh) 一种基于深度点云的移动机器人视觉伺服控制方法和系统
US20240058943A1 (en) Moving apparatus and moving apparatus control method
Li et al. Research on SLAM based on RBPF algorithm in indoor environment
CN113325849A (zh) 一种针对高地隙植保机的运动控制方法
JP3394472B2 (ja) スプライン補間による移動経路制御方法
CN113341943B (zh) 基于总扰动即时观测与迭代学习的重复作业式无人驾驶车辆轨迹跟踪控制算法
Zhang et al. An Improved Localization Algorithm for Intelligent Robot

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: 22897677

Country of ref document: EP

Kind code of ref document: A1

NENP Non-entry into the national phase

Ref country code: DE