WO2022193584A1 - 一种面向多场景的自动驾驶规划方法及*** - Google Patents

一种面向多场景的自动驾驶规划方法及*** Download PDF

Info

Publication number
WO2022193584A1
WO2022193584A1 PCT/CN2021/118608 CN2021118608W WO2022193584A1 WO 2022193584 A1 WO2022193584 A1 WO 2022193584A1 CN 2021118608 W CN2021118608 W CN 2021118608W WO 2022193584 A1 WO2022193584 A1 WO 2022193584A1
Authority
WO
WIPO (PCT)
Prior art keywords
reference route
vehicle
trajectory
local
global
Prior art date
Application number
PCT/CN2021/118608
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 WO2022193584A1 publication Critical patent/WO2022193584A1/zh

Links

Images

Classifications

    • GPHYSICS
    • G01MEASURING; TESTING
    • G01CMEASURING DISTANCES, LEVELS OR BEARINGS; SURVEYING; NAVIGATION; GYROSCOPIC INSTRUMENTS; PHOTOGRAMMETRY OR VIDEOGRAMMETRY
    • G01C21/00Navigation; Navigational instruments not provided for in groups G01C1/00 - G01C19/00
    • G01C21/26Navigation; Navigational instruments not provided for in groups G01C1/00 - G01C19/00 specially adapted for navigation in a road network
    • G01C21/34Route searching; Route guidance
    • G01C21/3407Route searching; Route guidance specially adapted for specific applications
    • G01C21/3415Dynamic re-routing, e.g. recalculating the route when the user deviates from calculated route or after detecting real-time traffic data or accidents
    • GPHYSICS
    • G01MEASURING; TESTING
    • G01CMEASURING DISTANCES, LEVELS OR BEARINGS; SURVEYING; NAVIGATION; GYROSCOPIC INSTRUMENTS; PHOTOGRAMMETRY OR VIDEOGRAMMETRY
    • G01C21/00Navigation; Navigational instruments not provided for in groups G01C1/00 - G01C19/00
    • G01C21/26Navigation; Navigational instruments not provided for in groups G01C1/00 - G01C19/00 specially adapted for navigation in a road network
    • G01C21/34Route searching; Route guidance
    • G01C21/3453Special cost functions, i.e. other than distance or default speed limit of road segments
    • G01C21/3461Preferred or disfavoured areas, e.g. dangerous zones, toll or emission zones, intersections, manoeuvre types, segments such as motorways, toll roads, ferries
    • YGENERAL TAGGING OF NEW TECHNOLOGICAL DEVELOPMENTS; GENERAL TAGGING OF CROSS-SECTIONAL TECHNOLOGIES SPANNING OVER SEVERAL SECTIONS OF THE IPC; TECHNICAL SUBJECTS COVERED BY FORMER USPC CROSS-REFERENCE ART COLLECTIONS [XRACs] AND DIGESTS
    • Y02TECHNOLOGIES OR APPLICATIONS FOR MITIGATION OR ADAPTATION AGAINST CLIMATE CHANGE
    • Y02TCLIMATE CHANGE MITIGATION TECHNOLOGIES RELATED TO TRANSPORTATION
    • Y02T10/00Road transport of goods or passengers
    • Y02T10/10Internal combustion engine [ICE] based vehicles
    • Y02T10/40Engine management systems

Definitions

  • the invention belongs to the technical field of automatic driving vehicles, and in particular relates to a multi-scene-oriented automatic driving planning method and system.
  • Path planning or motion trajectory planning is one of the basic technologies for autonomous vehicles. Considering the motion model of the vehicle and the surrounding obstacles, path planning will generate a series of states to make the vehicle transition from the initial state to the desired state. As the target location and traffic environment change, autonomous vehicles need to adopt different behaviors to accomplish time-varying driving tasks. When driving in urban areas, road obstacles are easy to detect and track, traffic scenarios are relatively regulated and simple, and it is sufficient to navigate autonomous vehicles by following or changing lanes and overtaking obstacles ahead. When the road is remodeled by the traffic infrastructure, or the vehicle is required to reach the designated position, it is difficult to complete the task simply by following or changing the lane and overtaking the obstacles in front of the vehicle. More complex and precise planning algorithms are needed to achieve this task.
  • the purpose of the present invention is to overcome the above-mentioned shortcomings of the prior art, and propose a multi-scenario-oriented automatic driving planning method and system, which utilizes different reference route generation methods to deal with different traffic scenarios, and generates a road section that is highly drivable at the height of the current road section.
  • feasible motion trajectories can be planned under the whole road section through the sampling-based planning algorithm, so that the autonomous vehicle can more robustly deal with diverse traffic scenarios.
  • a multi-scenario-oriented autonomous driving planning method comprising the following steps:
  • the first local reference route is obtained by sampling the waypoints according to the position of the vehicle and the global reference route.
  • the hybrid A* algorithm is used to search and generate the reference route corresponding to the traffic section; the reference route is spliced and integrated into the first local reference route.
  • a complete local reference route is obtained; the reference route is smoothed under the conditions of vehicle kinematic constraints and obstacle constraints to obtain the final local reference route;
  • the path point sampling is performed according to the position of the vehicle and the global reference route to obtain the first local reference route, and the first local reference route is smoothed to obtain the final local reference route;
  • S4, S2-S3 are performed cyclically.
  • the process of S1 includes:
  • a global route search is performed to generate a set of global discrete route points with a contextual relationship, and the global discrete route points are used to generate a global reference route.
  • the grid resolution is higher near the vehicle position and lower at the distance from the vehicle position.
  • the point of the relative global path of the ego vehicle is determined, and the relative global path of the ego vehicle from the far and near directions within the preset distance from the point is determined.
  • the point pushback of combined with the grid map, to find the local target point, the local target point satisfies: within the range of the grid map, and there are no obstacles within the grid where this point is located and the preset distance range around it;
  • the local target point is not found when pushing back to the point relative to the global path of the self-vehicle, a point in front of the self-vehicle with no surrounding obstacles is taken as the local target point.
  • the process of splicing and integrating the reference route into the first local reference route includes:
  • the starting point and the ending point in the local reference route are selected as the splicing points, and the corresponding closest point in the first local reference route is searched according to the starting point and the ending point, and the splicing is performed.
  • the starting planning point on the final local reference route is calculated according to the self-vehicle positioning information, and then the Cartesian coordinates in the local reference route are converted into Frenet coordinates;
  • the obstacle information is processed first, and the corresponding SL map (ie longitudinal displacement-horizontal displacement map) and ST map (ie longitudinal displacement-time map) are established based on the reference route when processing obstacles;
  • polynomial fitting is performed between the state at time T1 and the state at time T0 to generate two polynomial trajectories in the horizontal and vertical directions, and two-dimensional synthesis of the two polynomial trajectories in the horizontal and vertical directions is performed to obtain a trajectory set;
  • the process of finding the optimal trajectory from the trajectory set includes:
  • the trajectory in the Frenet coordinate system is converted into the trajectory in the Cartesian coordinate system and returned to the trajectory; If at least one of the vehicle motion constraints and the no-collision condition is not met, the trajectory is eliminated, and the trajectory with the lowest cost is selected to continue detection until a trajectory that satisfies both of the above conditions is found;
  • the cost C total of each trajectory in the trajectory set is calculated by the following formula:
  • ⁇ lon_obj , ⁇ lon_jerk , ⁇ collision and ⁇ lat_offset are the weight of missed target, longitudinal jerk weight, collision weight and lateral offset weight, respectively
  • C lon_obj , C lon_jerk , C collision and C lat_offset are missed target, respectively Target cost, longitudinal jerk cost, collision cost, lateral offset cost.
  • the position of the self-vehicle is obtained by reading GPS positioning and laser SLAM positioning on the vehicle.
  • the present invention provides a multi-scenario-oriented automatic driving planning system for implementing the multi-scenario-oriented automatic driving planning method of the present invention.
  • the system includes:
  • Global planning module used to parse the map topology information, obtain the global reference route, and output the global reference route;
  • Reference route providing module used to generate a local reference route according to whether there is an optimal trajectory, the position of the vehicle and the global reference route. The process includes;
  • the first local reference route is obtained by sampling the waypoints according to the position of the vehicle and the global reference route.
  • the hybrid A* algorithm is used to search and generate the reference route corresponding to the traffic section; the reference route is spliced and integrated into the first local reference route.
  • a complete local reference route is obtained; the reference route is smoothed under the conditions of vehicle kinematic constraints and obstacle constraints to obtain the final local reference route;
  • the path point sampling is performed according to the position of the vehicle and the global reference route to obtain the first local reference route, and the first local reference route is smoothed to obtain the final local reference route;
  • Local planning module It is used to obtain the optimal trajectory according to the position of the self-vehicle, obstacle information and the final local reference route, and output the result of whether there is an optimal trajectory.
  • the multi-scene-oriented automatic driving planning method of the present invention adopts the hybrid A* algorithm for complex scenes such as parking lots, narrow road U-turns, and construction road occupations to generate drivable routes that are highly in line with real traffic, and splicing and integrating them into high-precision
  • the generated reference route is highly similar to the actual drivable route in the traffic scene, and then the motion trajectory planning is carried out through the sampling-based method, which enhances the robustness of the planning algorithm and enables the autonomous vehicle to effectively Cope with complex and diverse traffic scenarios.
  • Fig. 1 is a schematic diagram of the overall planning flow of the present invention
  • FIG. 2 is a schematic diagram of a semi-structured scene of the present invention
  • Fig. 3 is the schematic diagram of behavior Frenet coordinate system in the method of the present invention.
  • FIG. 4 is a schematic diagram of a lateral trajectory in the method of the present invention.
  • FIG. 5 is a schematic diagram of a longitudinal trajectory in the method of the present invention.
  • the multi-scenario-oriented automatic driving planning method of the present invention includes the following steps:
  • the global planning module outputs a global reference route containing high-precision map semantic information and topology information
  • S1 includes the following sub-steps:
  • S11 Analyze the map topology information to obtain a road network including road physical information and semantic information;
  • S12 Perform a global route search according to the starting point and the end position to obtain an initial global reference route.
  • the reference route providing module outputs the local reference route to the local planning module according to the global reference route and the position of the vehicle;
  • S2 includes the following sub-steps:
  • S21 Read GPS positioning and laser SLAM positioning to determine the position of the vehicle
  • S22 Generate a local reference route and output it to the local planning module according to the state of the vehicle, the state of the local planning module in the previous frame, and the global reference route.
  • Step S22 includes: if the state of the local planning module in the previous frame is returned successfully (the first frame at the beginning of the planning is successful by default), sampling the path points according to the position of the vehicle and the global reference route to obtain a local reference route PATH_1, and smoothing the PATH_1 After processing, it is sent to the local planning module.
  • the module status of the local planning module in the previous frame fails to return, firstly obtain a local reference route PATH_1 by sampling the waypoints according to the position of the vehicle and the global reference route, and use the hybrid A* algorithm to search and generate the reference route PATH_2 corresponding to the traffic section; then The PATH_2 is spliced and integrated into PATH_1 to obtain a complete reference route; finally, the reference route is smoothed under the conditions of vehicle kinematic constraints and obstacle constraints, and the smoothed reference route is sent to the local planning module.
  • the splicing and integration process of PATH_1 and PATH_2 in the sub-step S22 specifically includes the following sub-steps:
  • S221 Select the start point and the end point in PATH_2 as the splicing point to ensure that the entire section of PATH_1 is retained;
  • S223 Select the front and rear splicing points on PATH_1 according to the two closest points and related parameters;
  • S224 Using cubic spline interpolation, splicing the front end of PATH_1, the entire segment of PATH_2, and the end of PATH_1 to form a complete reference route.
  • the local planning module uses the planning method based on the Frenet coordinate system to generate a feasible and safe motion trajectory
  • S3 specifically includes the following sub-steps:
  • S32 Establish corresponding SL map and ST map based on the local reference route according to the obstacle information
  • the multi-scenario-oriented automatic driving planning method in this embodiment includes the following steps:
  • the global planning module outputs a global reference route containing high-precision map semantic information and topology information:
  • the global planning module first parses the map topology information, mainly including lane-related information and lane topology relationship, and parses to obtain a road network containing road physical information and semantic information. Perform global route search based on road network information, positioning information, and mission starting and target points.
  • the search algorithm adopts the Dijkstra algorithm to preliminarily determine the road sections that need to be passed, and then determine the route within the road section according to the connection relationship, generate a set of global discrete route points with context, and generate a global reference route according to the set of global discrete route points with context. .
  • the reference route providing module outputs the reference route to the local planning module according to the position of the vehicle and the global reference route:
  • the process of the reference route providing module mainly includes: reading GPS positioning and laser SLAM positioning, determining the position of the vehicle; generating a local reference route according to the vehicle state, the state of the local planning module in the previous frame and the global reference route and outputting it to the local planning module: if If the status of the local planning module in the previous frame is returned successfully (the first frame at the beginning of the planning is successful by default), then a local reference route PATH_1 is obtained by sampling the path points according to the position of the vehicle and the global reference route, and the PATH_1 is sent to the local after smoothing processing. planning module.
  • the state of the local planning module in the previous frame fails to return (generally occurs in semi-structured scenarios such as parking lots, construction occupied roads, etc., as shown in Figure 2), firstly, sampling the path points according to the position of the vehicle and the global reference route to obtain a local Refer to the route PATH_1, and use the hybrid A* algorithm to search and generate the reference route PATH_2 corresponding to the traffic section; then splicing and integrating PATH_2 into PATH_1 to obtain a complete reference route; finally, considering the vehicle kinematic constraints and obstacle constraints The reference route is smoothed, and the smoothed reference route is sent to the local planning module.
  • the desired output is a trajectory (sequence of vehicle states s 0 , s 1 , . i-1
  • the present invention improves and supplements the hybrid A* method.
  • the present invention changes the resolution of the grid, and changes the resolution of the grid to a The location is high and the distance is low, which can speed up the search speed while still retaining a high path accuracy around the vehicle body.
  • the second is to analyze and describe how to determine the local target of a search when the global path is determined.
  • the global reference path indicates However, due to the change of road conditions and the appearance of new obstacles at any time in reality, it is necessary to combine the global reference path and the obstacles around the vehicle to determine the local end point of a hybrid A* algorithm planning.
  • the method is to first determine the point of the own vehicle relative to the global path, start pushing back from the distance 100 meters away from the point (that is, from the 200th point), and combine the grid map to try to find the first such point: that is, in the grid Within the range of the grid map, and there are no obstacles in the grid where this point is located and within 2 to 5 meters around it. Take this point as the local target point. If the local target point is not found after pushing back to the point where the vehicle is located, then Try to use a point directly in front of the vehicle with no surrounding obstacles as the local target point.
  • the process of splicing two reference paths into a reference route includes selecting the starting point and the ending point in the path PATH_2 planned by the hybrid A* as the splicing point, and searching the reference route PATH_1 extracted from the global reference path according to the starting point and the ending point. the closest point.
  • a splicing interval of 1.5 to 2.5 meters is reserved to ensure that the path after interpolation and smoothing is better close to the real environment.
  • the interpolation method used in this application is cubic spline interpolation, and a higher-order spline interpolation method can also be used if necessary.
  • the local planning module uses the planning method based on the Frenet coordinate system to generate a feasible and safe motion trajectory
  • the first thing to do is to calculate the starting planning point on the reference route (that is, the starting point of each cycle trajectory planning) according to the GPS positioning of the vehicle, and then convert the Cartesian coordinates (X-Y) in the reference route.
  • S represents the longitudinal displacement of the vehicle in the Frenet coordinate system, that is, the distance along the reference route
  • L represents the lateral displacement of the vehicle in the Frenet coordinate system, that is, the distance from the reference route to the left and right positions .
  • the starting point of the autonomous vehicle in the Frenet coordinate system and the state information of the starting point are calculated, which are expressed as the state at time T0.
  • the obstacles need to be processed first.
  • the method we use is to establish the corresponding SL map and ST map based on the reference route.
  • the state at time T1 and the state at time T0 are polynomially fitted to generate two polynomial trajectories in the horizontal and vertical directions, as shown in Figure 4 and Figure 5. Finally, the two polynomial trajectories in the horizontal and vertical directions are synthesized in two dimensions.
  • the process of generating the trajectory includes: given a series of times, calculating the longitudinal and lateral offsets of the vehicle at the series of times, and generating a series of two-dimensional plane trajectory points according to the reference route.
  • a series of time points Through a series of time points, a series of trajectory points are obtained by calculation, and then a trajectory set is generated.
  • the trajectory set is obtained, and the cost of each trajectory is calculated. This cost mainly considers the feasibility, comfort and safety of the trajectory:
  • C total ⁇ lon_obj *C lon_obj + ⁇ lon_jerk *C lon_jerk + ⁇ collision *C collision + ⁇ lat_offset *C lat_offset , where ⁇ lon_obj , ⁇ lon_jerk , ⁇ collision and ⁇ lat_offset are the weight of the missed target and the longitudinal jerk, respectively
  • C lon_obj , C lon_jerk , C collision and C lat_offset are the missed target cost, longitudinal jerk cost, collision cost, and lateral offset cost, respectively.
  • the last step is to find the optimal trajectory, which is a process of cyclic detection of the trajectory.
  • physical limit detection and collision detection are first performed on the least expensive trajectories. If both conditions are satisfied at the same time, the trajectory in the Frenet coordinate system is converted into a trajectory in the Cartesian coordinate system and returned; if either condition is not satisfied, the trajectory is eliminated, and then the lowest cost trajectory is selected Continue to detect until a trajectory that satisfies both conditions is found. If a matching motion trajectory cannot be found, set the local planning module status to fail, and then jump to the reference route providing module to regenerate the operation reference route.
  • the present invention is a multi-scenario-oriented automatic driving planning method for navigating an automatic driving vehicle.
  • the semi-structured scenes such as parking lots, narrow road U-turns, and construction road occupations are effectively integrated with the reference routes of urban roads, viaducts and other structured scenes, ensuring that the reference route is similar to the actual drivable route.
  • An algorithmic framework for the planning of motion trajectories greatly enhances the robustness of the planning method, enabling autonomous vehicles to effectively deal with complex and diverse traffic scenarios.

Landscapes

  • Engineering & Computer Science (AREA)
  • Radar, Positioning & Navigation (AREA)
  • Remote Sensing (AREA)
  • Automation & Control Theory (AREA)
  • Physics & Mathematics (AREA)
  • General Physics & Mathematics (AREA)
  • Traffic Control Systems (AREA)
  • Control Of Driving Devices And Active Controlling Of Vehicle (AREA)

Abstract

一种面向多场景的自动驾驶规划方法包括:获取全局参考路线(S1);根据是否已有最优轨迹、自车位置以及全局参考路线生成局部参考路线:若无最优轨迹,根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,同时利用混合A*算法搜索生成对应交通路段的参考路线并拼接整合到第一局部参考路线中;在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理;若已有最优轨迹,根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,并进行平滑处理(S2);根据自车位置、障碍物信息和最终的局部参考路线获取最优轨迹(S3);循环进行S2-S3( S4)。一种面向多场景的自动驾驶规划***,包括:全局规划模块;参考路线提供模块;局部规划模块。方法和***使得自动驾驶车辆能够更鲁棒的应对多样化的交通场景。

Description

一种面向多场景的自动驾驶规划方法及*** 技术领域
本发明属于自动驾驶汽车技术领域,具体涉及一种面向多场景的自动驾驶规划方法及***。
背景技术
路径规划或者说运动轨迹规划是自动驾驶车辆的基本技术之一,在考虑车辆的运动模型和周围的障碍物的情况下,路径规划会生成一系列状态,使得车辆从初始状态转换到期望状态。随着目标位置和交通环境的变化,自动驾驶汽车需要采用不同的行为来完成时变的驾驶任务。当在城市地区驾驶时,路面障碍物容易检测和跟踪,交通场景相对规范和简单,通过跟随或改变行车道和超车前方障碍物来导航自动驾驶车辆就足够了。当道路被交通基础设施重新改造,或者要求车辆到达指定位置时,简单的通过跟随或改变行车道和超车前方障碍物难以完成任务,需要利用更复杂和精确的规划算法来实现这一任务。
近年来,机器人学文献中提出了许多路径规划方法。但这些规划方法都只在特定的交通场景下或部分交通场景下表现出较好的效果,无法同时有效应对绝大多数的交通场景。对于结构化的城市交通场景,基于高精度地图规划出的全局参考路线与真实交通场景的可行驶路线偏差较小,从全局参考路线中提取局部参考路线并通过基于采样的规划算法就可以较好的满足自动驾驶轨迹规划的需求。但在例如在停车场、窄路掉头、施工占道等交通场景下,基于高精度地图规划出的全局参考路线和真实的可行驶路线存在较大的偏离,在这些场景下如果继续根据基于高精度地图规划的全局参考路线做轨迹规划,基于采样的规划算法所规划出的轨迹将变得不可行。
发明内容
本发明的目的在于克服上述现有技术的缺点,提出一种面向多场景的自动驾驶规划方法及***,利用不同的参考路线生成方法应对不同的交通场景,生成一条在当前路段高度符合真实可行驶路线的局部参考路线,通过基于采样的规划算法就能在全路段下规划出可行的运动轨迹,使得自动驾驶车辆能够更鲁棒的应对多样化的交通场景。
本发明的目的采用以下技术方案实现:
一种面向多场景的自动驾驶规划方法,包括如下步骤:
S1,对地图拓扑信息进行解析,利用解析的结果获取全局参考路线;
S2,根据是否已有最优轨迹、自车位置以及全局参考路线生成局部参考路线,过程包括;
若无最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,同时利用混合A*算法搜索生成对应交通路段的参考路线;将参考路线拼接整合到第一局部参考路线中,得到完整的局部参考路线;在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,得到最终的局部参考路线;
若已有最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,并对第一局部参考路线进行平滑处理,得到最终的局部参考路线;
S3,根据自车位置、障碍物信息和最终的局部参考路线获取最优轨迹;
S4,循环进行S2-S3。
优选的,S1的过程包括:
对地图拓扑信息进行解析,得到包含道路物理信息和语义信息的路网;
根据路网信息、自车定位信息以及任务起点和目标点进行全局路线搜索,生成一组有前后关系的全局离散路线点,利用全局离散路线点生成全局参考路线。
优选的,S2中,利用混合A*算法搜索生成对应交通路段的参考路线时,将栅格分辨率采用距离自车位置近处较高、距离自车位置远处较低的形式。
优选的,S2中,利用混合A*算法搜索生成对应交通路段的参考路线时,确定自车相对全局路径的点,在距该点预设距离的范围内由远及近向自车相对全局路径的点回推,结合栅格图,寻找局部目标点,所述局部目标点满足:在栅格图范围内,并且这个点所在栅格和周围预设距离范围内没有障碍物;
如果直至回推到自车相对全局路径的点时未找到局部目标点,则将自车正前方某一个周围没有障碍物的点作为局部目标点。
优选的,S2中,将参考路线拼接整合到第一局部参考路线中的过程包括:
选取局部参考路线中的起始点和终止点作为拼接点,根据起始点和终止点查找第一局部参考路线中的对应的最近点并进行拼接。
优选的,S3中,根据自车定位信息计算最终的局部参考路线上的起始规划点,然后将局部参考路线中的笛卡尔坐标转换为Frenet坐标;
计算自动驾驶车辆在Frenet坐标系下的起始点以及起始点的状态信息,起始点的状态信息表示为T0时刻状态;
在采样之前,先对障碍物信息进行处理,对障碍物进行处理时基于参考路线建立对应的SL图(即纵向位移-横向位移图)和ST图(即纵向位移-时间图);
障碍物信息处理完成后,开始采样下一个T1时刻的末状态,表示为T1时刻状态;
采样之后,将T1时刻状态和T0时刻状态做多项式拟合,生成横向和纵向的两个多项式轨迹,将横向和纵向的两个多项式轨迹进行二维合成,得到轨迹集;
从轨迹集中找到最优轨迹。
优选的,从轨迹集中找到最优轨迹的过程包括:
计算轨迹集中每一条轨迹的代价C total
对代价最低的轨迹进行物理限制检测和碰撞检测,若同时满足车辆运动约束条件和无碰撞 这两种条件,则将Frenet坐标系下的轨迹转换成笛卡尔坐标系下的轨迹并返回该轨迹;若不满足车辆运动约束条件和无碰撞条件中至少一个条件,则将该轨迹剔除,再选择最低代价的轨迹继续检测,直到找到同时满足上述两个条件的轨迹;
如果未找到符合条件的轨迹,然后进行S4。
优选的:轨迹集中每一条轨迹的代价C total通过下式计算:
C total=ω lon_obj*C lon_objlon_jerk*C lon_jerkcollision*C collisionlat_offset*C lat_offset
其中,ω lon_obj、ω lon_jerk、ω collision和ω lat_offset分别为错过目标的权重、纵向加加速度的权重、碰撞的权重和横向偏移的权重,C lon_obj、C lon_jerk、C collision和C lat_offset分别为错过目标代价、纵向加加速度代价、碰撞代价、横向偏移代价。
优选的,自车位置通过读取车上的GPS定位和激光SLAM定位获取。
本发明提供了一种面向多场景的自动驾驶规划***,用于实现本发明如上所述面向多场景的自动驾驶规划方法,该***包括:
全局规划模块:用于对地图拓扑信息进行解析,获取全局参考路线,并输出全局参考路线;
参考路线提供模块:用于根据是否已有最优轨迹、自车位置以及全局参考路线生成局部参考路线,过程包括;
若无最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,同时利用混合A*算法搜索生成对应交通路段的参考路线;将参考路线拼接整合到第一局部参考路线中,得到完整的局部参考路线;在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,得到最终的局部参考路线;
若已有最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,并对第一局部参考路线进行平滑处理,得到最终的局部参考路线;
并输出局部参考路线;
局部规划模块:用于根据自车位置、障碍物信息和最终的局部参考路线获取最优轨迹,并输出是否已有最优轨迹的结果。
相比现有技术,本发明的有益效果在于:
本发明的面向多场景的自动驾驶规划方法,针对如停车场、窄路掉头、施工占道这些复杂场景采用混合A*算法生成高度符合真实交通可行驶路线,并将其拼接整合到基于高精度地图规划出的局部参考路线中,使得生成的参考路线高度相似于交通场景实际可行驶路线,再通过基于采样的方法进行运动轨迹规划,增强了规划算法的鲁棒性,使得自动驾驶车辆能够有效应对复杂的、多样化的交通场景。
附图说明
图1为本发明全局规划流程示意图;
图2为本发明半结构化场景示意图;
图3为本发明方法中行为Frenet坐标系示意图;
图4为本发明方法中横向轨迹示意图;
图5为本发明方法中纵向轨迹示意图。
具体实施方式
下面结合附图和实施例对本发明做进一步详细描述:
参照图1、图3-图5,本发明面向多场景的自动驾驶规划方法包括如下步骤:
S1:全局规划模块输出包含高精度地图语义信息以及拓扑信息的全局参考路线;
S1包括以下子步骤:
S11:对地图拓扑信息进行解析,得到一个包含道路物理信息和语义信息的路网;
S12:根据起始点和终点位置进行全局路线搜索,得到一条初始的全局参考路线。
S2:参考路线提供模块根据全局参考路线和自车位置向局部规划模块输出局部参考路线;
S2包括以下子步骤:
S21:读取GPS定位和激光SLAM定位,确定自车位置;
S22:根据自车车辆状态、上一帧局部规划模块状态以及全局参考路线生成一条局部参考路线输出给局部规划模块。
步骤S22包括:如果上一帧局部规划模块状态返回成功(规划起始第一帧默认为成功),则根据自车位置和全局参考路线进行路径点采样得到一条局部参考路线PATH_1,将PATH_1进行平滑处理之后发送给局部规划模块。如果上一帧局部规划模块的模块状态返回失败,首先根据自车位置和全局参考路线进行路径点采样得到一条局部参考路线PATH_1,同时利用混合A*算法搜索生成对应交通路段的参考路线PATH_2;然后将PATH_2拼接整合到PATH_1中,得到一条完整的参考路线;最后在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,并将平滑后的参考路线发送给局部规划模块。
所述子步骤S22中的PATH_1和PATH_2的拼接整合过程具体包括以下子步骤:
S221:选取PATH_2中的起始点和终止点作为拼接点,确保PATH_1全段保留;
S222:根据S241中的起始点和终止点查找PATH_1中的最近点;
S223:根据两个最近点和相关参数选择PATH_1上的前后两个拼接点;
S224:采用3次样条插值,拼接PATH_1前端、PATH_2全段、PATH_1末端,形成一条完整的参考路线。
S3:局部规划模块使用基于Frenet坐标系下的规划方法生成一条可行的、安全的运动轨迹;
S3具体包括以下子步骤:
S31:根据自车位置计算局部参考路线上起始规划点,并初始化Frenet信息;
S32:根据障碍物信息基于局部参考路线建立对应的SL图和ST图;
S33:基于采样的方法生成轨迹集;
S34:计算每一条轨迹的代价;
S35:循环检测,返回符合条件的运动轨迹;若无符合条件的运动轨迹,则跳转步骤S2,重新规划参考路线。
实施例
如图1所示,本实施例面向多场景的自动驾驶规划方法包含以下步骤:
S1:全局规划模块输出包含高精度地图语义信息以及拓扑信息的全局参考路线:
如图1所示,全局规划模块首先是对地图拓扑信息进行解析,主要包括车道相关信息和车道拓扑关系,解析得到一个包含道路物理信息和语义信息的路网。根据路网信息、定位信息以及任务起点和目标点进行全局路线搜索。搜索算法采用Dijkstra算法,初步确定需要经过的路段,再根据连接关系确定路段内的路线,生成一组有前后关系的全局离散路线点,根据该组有前后关系的全局离散路线点生成全局参考路线。
S2:参考路线提供模块根据自车位置和全局参考路线向局部规划模块输出参考路线:
参考路线提供模块的流程主要包括:读取GPS定位和激光SLAM定位,确定自车位置;根据车辆状态、上一帧局部规划模块状态以及全局参考路线生成一条局部参考路线输出给局部规划模块:如果上一帧局部规划模块状态返回成功(规划起始第一帧默认为成功),则根据自车位置和全局参考路线进行路径点采样得到一条局部参考路线PATH_1,将PATH_1进行平滑处理之后发送给局部规划模块。如果上一帧局部规划模块状态返回失败(一般发生在停车场、施工占道等半结构化场景中,如图2所示),首先根据自车位置和全局参考路线进行路径点采样得到一条局部参考路线PATH_1,同时利用混合A*算法搜索生成对应交通路段的参考路线PATH_2;然后将PATH_2拼接整合到PATH_1中,得到一条完整的参考路线;最后在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,并将平滑后的参考路线发送给局 部规划模块。
混合A*算法的输入是激光雷达检测得到的障碍物栅格图,以及车辆的初始状态s 0=<x,y,θ> 0和目标状态s g=<x,y,θ> g,其中<x,y,θ>分别是车辆的位置和车头朝向。期望的输出是安全平滑并且满足汽车运动学约束(转弯半径)的轨迹(车辆状态序列s 0,s 1,...s n=s g,具有特定分辨率δ s(||s i-s i-1||≤δ s)。本发明对混合A*方法进行了改进和补充。其一是根据感知范围的特性,本发明更改了栅格的分辨率,将栅格分辨率改为近处高远处低,这样能够加速搜索速度,同时在车身周围仍保留有较高路径精度。其二是对在全局路径确定的情况下如何确定一次搜索的局部目标进行了分析描述。全局参考路径指明了大致的行驶方向,但是由于现实中随时会出现路况的变化和新的障碍物出现,所以需要结合全局参考路径和车辆周围的障碍物情况决定一次混合A*算法规划的局部终点。本发明的做法是首先确定自身车辆相对全局路径的点,从距离该点100米远的距离(即从第200个点)开始回推,结合栅格图,尝试找到第一个这样的点:即在栅格图范围内,并且这个点所在栅格和周围2~5米范围内都没有障碍物。将这个点作为局部目标点。如果一直回推到自身车辆所在的点都没有找到局部目标点,则尝试使用车辆正前方某一个周围没有障碍物的点作为局部目标点。
两条参考路径拼接成参考路线的处理过程包括,选取混合A*规划出的路径PATH_2中的起始点和终止点作为拼接点,根据起始点和终止点查找全局参考路径上提取的参考路线PATH_1中的最近点。对于PATH_1中的拼接点选取,留取1.5~2.5米的拼接间隔,以保证经过插值和平滑处理后的路径较好的接近真实环境。本申请所用的插值方法为三次样条插值,若具体需要也可采用更高阶的样条插值方法。
S3:局部规划模块使用基于Frenet坐标系下的规划方法生成一条可行的、安全的运动轨迹
在确定了参考路线之后,首先要做的是根据自车GPS定位计算参考路线上的起始规划点 (即每次循环轨迹规划的起点),然后将参考路线中的笛卡尔坐标(X-Y)转换为Frenet坐标(S-L,纵向位移-横向位移)。Frenet坐标系如图3所示,S代表车辆在Frenet坐标系下的纵向位移量,即沿参考路线上距离;L代表车辆在Frenet坐标系的横向位移量,即从参考路线到左右位置的距离。转换坐标之后,计算自动驾驶车辆在Frenet坐标系下的起始点以及起始点的状态信息,表示为T0时刻状态。在采样之前,需要先对障碍物进行处理,我们采用的方法是基于参考路线建立对应的SL图和ST图。障碍物信息处理完成后,开始采样下一个T1时刻的末状态,表示为T1时刻状态。采样之后,将T1时刻状态和T0时刻状态做多项式拟合,生成横向和纵向的两个多项式轨迹,如图4和图5所示。最后,将横向和纵向的两个多项式轨迹进行二维合成。根据上述,生成轨迹过程包括:给定一系列时刻,计算车辆这一系列时刻的纵向和横向的偏移量,根据参考路线生成一系列二维平面的轨迹点。通过一系列的时间点,计算得到一系列的轨迹点,然后生成一个轨迹集。得到了轨迹集,开始计算每一条轨迹的代价,这个代价主要考虑了轨迹的可行性、舒适性和安全性:
C total=ω lon_obj*C lon_objlon_jerk*C lon_jerkcollision*C collisionlat_offset*C lat_offset,其中,ω lon_obj、ω lon_jerk、ω collision和ω lat_offset分别为错过目标的权重、纵向加加速度的权重、碰撞的权重和横向偏移的权重,C lon_obj、C lon_jerk、C collision和C lat_offset分别为错过目标代价、纵向加加速度代价、碰撞代价、横向偏移代价。
最后一步,找到最优轨迹,这是一个对轨迹进行循环检测的过程。在这个过程中,首先对代价最低的轨迹进行物理限制检测和碰撞检测。若同时满足这两种条件,则将该Frenet坐标系下的轨迹转换成笛卡尔坐标系下的轨迹并返回该轨迹;若不满足任意一个条件,则将该轨迹剔除,再选择最低代价的轨迹继续检测,直到找到同时满足两个条件的轨迹。如果无法找到符合条件的运动轨迹,则将局部规划模块状态设置为失败,然后跳转到参考路线提供模块重新生成操参考路线。
综上所述,本发明面向多场景的自动驾驶规划方法,用于导航自动驾驶车辆。将停车场、窄路掉头、施工占道等半结构化场景和城市道路、高架桥等结构化场景的参考路线有效的整合到一起,保证了参考路线与实际可行驶路线的高度相似,然后通过同一个算法框架进行运动轨迹的规划,大大增强了规划方法的鲁棒性,使得自动驾驶车辆能够有效应对复杂的、多样化的交通场景。

Claims (10)

  1. 一种面向多场景的自动驾驶规划方法,其特征在于,包括如下步骤:
    S1,对地图拓扑信息进行解析,利用解析的结果获取全局参考路线;
    S2,根据是否已有最优轨迹、自车位置以及全局参考路线生成局部参考路线,过程包括;
    若无最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,同时利用混合A*算法搜索生成对应交通路段的参考路线;将参考路线拼接整合到第一局部参考路线中,得到完整的局部参考路线;在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,得到最终的局部参考路线;
    若已有最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,并对第一局部参考路线进行平滑处理,得到最终的局部参考路线;
    S3,根据自车位置、障碍物信息和最终的局部参考路线获取最优轨迹;
    S4,循环进行S2-S3。
  2. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,S1的过程包括:
    对地图拓扑信息进行解析,得到包含道路物理信息和语义信息的路网;
    根据路网信息、自车定位信息以及任务起点和目标点进行全局路线搜索,生成一组有前后关系的全局离散路线点,利用全局离散路线点生成全局参考路线。
  3. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,S2中,利用混合A*算法搜索生成对应交通路段的参考路线时,将栅格分辨率采用距离自车位置近处较高、距离自车位置远处较低的形式。
  4. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,S2中,利用混合A*算法搜索生成对应交通路段的参考路线时,确定自车相对全局路径的点,在距该点预设距离的范围内由远及近向自车相对全局路径的点回推,结合栅格图,寻找局部目标点,所述 局部目标点满足:在栅格图范围内,并且这个点所在栅格和周围预设距离范围内没有障碍物;
    如果直至回推到自车相对全局路径的点时未找到局部目标点,则将自车正前方某一个周围没有障碍物的点作为局部目标点。
  5. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,S2中,将参考路线拼接整合到第一局部参考路线中的过程包括:
    选取局部参考路线中的起始点和终止点作为拼接点,根据起始点和终止点查找第一局部参考路线中的对应的最近点并进行拼接。
  6. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,S3中,根据自车定位信息计算最终的局部参考路线上的起始规划点,然后将局部参考路线中的笛卡尔坐标转换为Frenet坐标;
    计算自动驾驶车辆在Frenet坐标系下的起始点以及起始点的状态信息,起始点的状态信息表示为T0时刻状态;
    在采样之前,先对障碍物信息进行处理,对障碍物进行处理时基于参考路线建立对应的纵向位移-横向位移图和纵向位移-时间图;
    障碍物信息处理完成后,开始采样下一个T1时刻的末状态,表示为T1时刻状态;
    采样之后,将T1时刻状态和T0时刻状态做多项式拟合,生成横向和纵向的两个多项式轨迹,将横向和纵向的两个多项式轨迹进行二维合成,得到轨迹集;
    从轨迹集中找到最优轨迹。
  7. 根据权利要求6所述的一种面向多场景的自动驾驶规划方法,其特征在于,从轨迹集中找到最优轨迹的过程包括:
    计算轨迹集中每一条轨迹的代价C total
    对代价最低的轨迹进行物理限制检测和碰撞检测,若同时满足车辆运动约束条件和无碰撞 条件,则将Frenet坐标系下的轨迹转换成笛卡尔坐标系下的轨迹并返回该轨迹;若不满足车辆运动约束条件和无碰撞条件中至少一个条件,则将该轨迹剔除,再选择最低代价的轨迹继续检测,直到找到同时满足上述两个条件的轨迹;
    如果未找到符合条件的轨迹,然后进行S4。
  8. 根据权利要求7所述的一种面向多场景的自动驾驶规划方法,其特征在于:
    轨迹集中每一条轨迹的代价C total通过下式计算:
    C total=ω lon_obj*C lon_objlon_jerk*C lon_jerkcollision*C collisionlat_offset*C lat_offset
    其中,ω lon_obj、ω lon_jerk、ω collision和ω lat_offset分别为错过目标的权重、纵向加加速度的权重、碰撞的权重和横向偏移的权重,C lon_obj、C lon_jerk、C collision和C lat_offset分别为错过目标代价、纵向加加速度代价、碰撞代价、横向偏移代价。
  9. 根据权利要求1所述的一种面向多场景的自动驾驶规划方法,其特征在于,自车位置通过读取车上的GPS定位和激光SLAM定位获取。
  10. 一种面向多场景的自动驾驶规划***,其特征在于,用于实现权利要求1-9任意一项所述面向多场景的自动驾驶规划方法,该***包括:
    全局规划模块:用于对地图拓扑信息进行解析,获取全局参考路线,并输出全局参考路线;
    参考路线提供模块:用于根据是否已有最优轨迹、自车位置以及全局参考路线生成局部参考路线,过程包括;
    若无最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路线,同时利用混合A*算法搜索生成对应交通路段的参考路线;将参考路线拼接整合到第一局部参考路线中,得到完整的局部参考路线;在考虑车辆运动学约束和障碍物约束条件下对参考路线进行平滑处理,得到最终的局部参考路线;
    若已有最优轨迹,则根据自车位置和全局参考路线进行路径点采样得到第一局部参考路 线,并对第一局部参考路线进行平滑处理,得到最终的局部参考路线;
    并输出局部参考路线;
    局部规划模块:用于根据自车位置、障碍物信息和最终的局部参考路线获取最优轨迹,并输出是否已有最优轨迹的结果。
PCT/CN2021/118608 2021-03-15 2021-09-15 一种面向多场景的自动驾驶规划方法及*** WO2022193584A1 (zh)

Applications Claiming Priority (2)

Application Number Priority Date Filing Date Title
CN202110276175.5A CN112964271B (zh) 2021-03-15 2021-03-15 一种面向多场景的自动驾驶规划方法及***
CN202110276175.5 2021-03-15

Publications (1)

Publication Number Publication Date
WO2022193584A1 true WO2022193584A1 (zh) 2022-09-22

Family

ID=76279290

Family Applications (1)

Application Number Title Priority Date Filing Date
PCT/CN2021/118608 WO2022193584A1 (zh) 2021-03-15 2021-09-15 一种面向多场景的自动驾驶规划方法及***

Country Status (2)

Country Link
CN (1) CN112964271B (zh)
WO (1) WO2022193584A1 (zh)

Cited By (19)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN115309170A (zh) * 2022-10-12 2022-11-08 之江实验室 一种考虑舒适性约束的轨迹规划方法、装置和***
CN115355916A (zh) * 2022-10-24 2022-11-18 北京智行者科技股份有限公司 移动工具的轨迹规划方法、设备和计算机可读存储介质
CN115454083A (zh) * 2022-09-23 2022-12-09 福州大学 基于快速扩展随机树与动态窗口法的双层路径规划方法
CN115755908A (zh) * 2022-11-17 2023-03-07 中国矿业大学 一种基于JPS引导Hybrid A*的移动机器人路径规划方法
CN115973197A (zh) * 2023-03-21 2023-04-18 宁波均胜智能汽车技术研究院有限公司 一种车道规划方法、装置、电子设备、可读存储介质
CN116069031A (zh) * 2023-01-28 2023-05-05 武汉理工大学 基于车体扫掠模型的地下无人矿车路径优化方法及***
CN116088538A (zh) * 2023-04-06 2023-05-09 禾多科技(北京)有限公司 车辆轨迹信息生成方法、装置、设备和计算机可读介质
CN116136417A (zh) * 2023-04-14 2023-05-19 北京理工大学 一种面向越野环境的无人驾驶车辆局部路径规划方法
CN116147653A (zh) * 2023-04-14 2023-05-23 北京理工大学 一种面向无人驾驶车辆的三维参考路径规划方法
CN116338729A (zh) * 2023-03-29 2023-06-27 中南大学 一种基于多层地图的三维激光雷达导航方法
CN116627145A (zh) * 2023-07-25 2023-08-22 陕西欧卡电子智能科技有限公司 无人游船的自主航行控制方法及***
CN116817947A (zh) * 2023-05-30 2023-09-29 北京航空航天大学 一种基于变步长机制的任意时路径规划方法
CN116817958A (zh) * 2023-08-29 2023-09-29 之江实验室 一种基于障碍物分组的参考路径生成方法、装置和介质
CN117075619A (zh) * 2023-10-17 2023-11-17 之江实验室 一种局部路径规划方法、装置和介质
CN117288213A (zh) * 2023-08-30 2023-12-26 苏州大成运和智能科技有限公司 一种自适应的动态窗口局部路径规划方法
CN117698769A (zh) * 2024-02-05 2024-03-15 上海鉴智其迹科技有限公司 自动驾驶的轨迹规划方法、装置、电子设备及存储介质
CN117782126A (zh) * 2023-12-25 2024-03-29 宋聪 高精地图引导的自动驾驶路径规划决策方法
CN117885764A (zh) * 2024-03-14 2024-04-16 中国第一汽车股份有限公司 车辆的轨迹规划方法、装置、车辆及存储介质
CN118107575A (zh) * 2024-04-30 2024-05-31 新石器中研(上海)科技有限公司 碰撞检查方法、控制装置、可读存储介质及驾驶设备

Families Citing this family (12)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN112964271B (zh) * 2021-03-15 2023-03-31 西安交通大学 一种面向多场景的自动驾驶规划方法及***
CN113359740A (zh) * 2021-06-18 2021-09-07 广州蓝胖子移动科技有限公司 一种轮式移动机器人及其控制方法、控制***、存储介质
CN113267199B (zh) * 2021-06-24 2023-01-06 上海欧菲智能车联科技有限公司 行驶轨迹规划方法及装置
CN113335310B (zh) * 2021-07-21 2021-11-30 新石器慧通(北京)科技有限公司 基于决策的运动规划方法、装置、电子设备及存储介质
CN113920768A (zh) * 2021-10-09 2022-01-11 四川智胜慧旅科技有限公司 一种适用于自驾型景区的车辆调度方法及***
CN114137970A (zh) * 2021-11-25 2022-03-04 杭州摸象大数据科技有限公司 一种用于机器人线路自动巡检方法
CN114114930B (zh) * 2022-01-28 2022-04-19 清华大学 汽车局部参考路径生成方法、装置、设备及介质
CN114506343B (zh) * 2022-03-02 2024-07-16 阿波罗智能技术(北京)有限公司 轨迹规划方法、装置、设备、存储介质及自动驾驶车辆
CN114995398A (zh) * 2022-05-16 2022-09-02 中国第一汽车股份有限公司 路径生成方法、装置、存储介质、处理器及电子装置
CN115079702B (zh) * 2022-07-18 2023-06-06 江苏集萃清联智控科技有限公司 一种混合道路场景下的智能车辆规划方法和***
CN116124162B (zh) * 2022-12-28 2024-03-26 北京理工大学 一种基于高精地图的园区小车导航方法
CN118068843B (zh) * 2024-04-25 2024-06-25 厦门中科星晨科技有限公司 一种基于参考轨迹优化的AStar路径规划方法及设备

Citations (11)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
US6169956B1 (en) * 1997-02-28 2001-01-02 Aisin Aw Co., Ltd. Vehicle navigation system providing for determination of a point on the border of a map stored in memory on the basis of a destination remote from the area covered by the map
CN107702716A (zh) * 2017-08-31 2018-02-16 广州小鹏汽车科技有限公司 一种无人驾驶路径规划方法、***和装置
CN108007471A (zh) * 2016-10-28 2018-05-08 北京四维图新科技股份有限公司 车辆引导区块获取方法和装置以及自动驾驶方法和***
CN108227695A (zh) * 2016-12-14 2018-06-29 现代自动车株式会社 自动驾驶控制装置、包括该装置的***及其方法
CN108549388A (zh) * 2018-05-24 2018-09-18 苏州智伟达机器人科技有限公司 一种基于改进a星策略的移动机器人路径规划方法
CN108549378A (zh) * 2018-05-02 2018-09-18 长沙学院 一种基于栅格地图的混合路径规划方法和***
CN109375632A (zh) * 2018-12-17 2019-02-22 清华大学 自动驾驶车辆实时轨迹规划方法
CN110081894A (zh) * 2019-04-25 2019-08-02 同济大学 一种基于道路结构权值融合的无人车轨迹实时规划方法
CN110609557A (zh) * 2019-10-09 2019-12-24 中国人民解放军陆军装甲兵学院 无人车混合路径规划算法
CN112362074A (zh) * 2020-10-30 2021-02-12 重庆邮电大学 一种结构化环境下的智能车辆局部路径规划方法
CN112964271A (zh) * 2021-03-15 2021-06-15 西安交通大学 一种面向多场景的自动驾驶规划方法及***

Family Cites Families (10)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
US7734387B1 (en) * 2006-03-31 2010-06-08 Rockwell Collins, Inc. Motion planner for unmanned ground vehicles traversing at high speeds in partially known environments
KR101664582B1 (ko) * 2014-11-12 2016-10-10 현대자동차주식회사 자율주행차량의 주행경로 생성장치 및 방법
CN108519773B (zh) * 2018-03-07 2020-01-14 西安交通大学 一种结构化环境下无人驾驶车辆的路径规划方法
KR102267563B1 (ko) * 2018-11-29 2021-06-23 한국전자통신연구원 자율주행 방법 및 그 시스템
CN110196592B (zh) * 2019-04-26 2023-07-28 纵目科技(上海)股份有限公司 一种轨迹线的更新方法、***、终端和存储介质
CN110207716B (zh) * 2019-04-26 2021-08-17 纵目科技(上海)股份有限公司 一种参考行驶线快速生成方法、***、终端和存储介质
CN110262488B (zh) * 2019-06-18 2021-11-30 重庆长安汽车股份有限公司 自动驾驶的局部路径规划方法、***及计算机可读存储介质
CN110766220A (zh) * 2019-10-21 2020-02-07 湖南大学 一种结构化道路局部路径规划方法
CN111811517A (zh) * 2020-07-15 2020-10-23 中国科学院上海微***与信息技术研究所 一种动态局部路径规划方法及***
CN112270306B (zh) * 2020-11-17 2022-09-30 中国人民解放军军事科学院国防科技创新研究院 一种基于拓扑路网的无人车轨迹预测与导航方法

Patent Citations (11)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
US6169956B1 (en) * 1997-02-28 2001-01-02 Aisin Aw Co., Ltd. Vehicle navigation system providing for determination of a point on the border of a map stored in memory on the basis of a destination remote from the area covered by the map
CN108007471A (zh) * 2016-10-28 2018-05-08 北京四维图新科技股份有限公司 车辆引导区块获取方法和装置以及自动驾驶方法和***
CN108227695A (zh) * 2016-12-14 2018-06-29 现代自动车株式会社 自动驾驶控制装置、包括该装置的***及其方法
CN107702716A (zh) * 2017-08-31 2018-02-16 广州小鹏汽车科技有限公司 一种无人驾驶路径规划方法、***和装置
CN108549378A (zh) * 2018-05-02 2018-09-18 长沙学院 一种基于栅格地图的混合路径规划方法和***
CN108549388A (zh) * 2018-05-24 2018-09-18 苏州智伟达机器人科技有限公司 一种基于改进a星策略的移动机器人路径规划方法
CN109375632A (zh) * 2018-12-17 2019-02-22 清华大学 自动驾驶车辆实时轨迹规划方法
CN110081894A (zh) * 2019-04-25 2019-08-02 同济大学 一种基于道路结构权值融合的无人车轨迹实时规划方法
CN110609557A (zh) * 2019-10-09 2019-12-24 中国人民解放军陆军装甲兵学院 无人车混合路径规划算法
CN112362074A (zh) * 2020-10-30 2021-02-12 重庆邮电大学 一种结构化环境下的智能车辆局部路径规划方法
CN112964271A (zh) * 2021-03-15 2021-06-15 西安交通大学 一种面向多场景的自动驾驶规划方法及***

Cited By (32)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN115454083A (zh) * 2022-09-23 2022-12-09 福州大学 基于快速扩展随机树与动态窗口法的双层路径规划方法
CN115309170B (zh) * 2022-10-12 2023-03-24 之江实验室 一种考虑舒适性约束的轨迹规划方法、装置和***
CN115309170A (zh) * 2022-10-12 2022-11-08 之江实验室 一种考虑舒适性约束的轨迹规划方法、装置和***
CN115355916A (zh) * 2022-10-24 2022-11-18 北京智行者科技股份有限公司 移动工具的轨迹规划方法、设备和计算机可读存储介质
CN115355916B (zh) * 2022-10-24 2023-03-03 北京智行者科技股份有限公司 移动工具的轨迹规划方法、设备和计算机可读存储介质
CN115755908B (zh) * 2022-11-17 2023-10-27 中国矿业大学 一种基于JPS引导Hybrid A*的移动机器人路径规划方法
CN115755908A (zh) * 2022-11-17 2023-03-07 中国矿业大学 一种基于JPS引导Hybrid A*的移动机器人路径规划方法
CN116069031A (zh) * 2023-01-28 2023-05-05 武汉理工大学 基于车体扫掠模型的地下无人矿车路径优化方法及***
CN116069031B (zh) * 2023-01-28 2023-08-11 武汉理工大学 基于车体扫掠模型的地下无人矿车路径优化方法及***
CN115973197A (zh) * 2023-03-21 2023-04-18 宁波均胜智能汽车技术研究院有限公司 一种车道规划方法、装置、电子设备、可读存储介质
CN115973197B (zh) * 2023-03-21 2023-08-11 宁波均胜智能汽车技术研究院有限公司 一种车道规划方法、装置、电子设备、可读存储介质
CN116338729A (zh) * 2023-03-29 2023-06-27 中南大学 一种基于多层地图的三维激光雷达导航方法
CN116088538A (zh) * 2023-04-06 2023-05-09 禾多科技(北京)有限公司 车辆轨迹信息生成方法、装置、设备和计算机可读介质
CN116088538B (zh) * 2023-04-06 2023-06-13 禾多科技(北京)有限公司 车辆轨迹信息生成方法、装置、设备和计算机可读介质
CN116147653B (zh) * 2023-04-14 2023-08-22 北京理工大学 一种面向无人驾驶车辆的三维参考路径规划方法
CN116147653A (zh) * 2023-04-14 2023-05-23 北京理工大学 一种面向无人驾驶车辆的三维参考路径规划方法
CN116136417B (zh) * 2023-04-14 2023-08-22 北京理工大学 一种面向越野环境的无人驾驶车辆局部路径规划方法
CN116136417A (zh) * 2023-04-14 2023-05-19 北京理工大学 一种面向越野环境的无人驾驶车辆局部路径规划方法
CN116817947A (zh) * 2023-05-30 2023-09-29 北京航空航天大学 一种基于变步长机制的任意时路径规划方法
CN116817947B (zh) * 2023-05-30 2024-02-23 北京航空航天大学 一种基于变步长机制的任意时路径规划方法
CN116627145B (zh) * 2023-07-25 2023-10-20 陕西欧卡电子智能科技有限公司 无人游船的自主航行控制方法及***
CN116627145A (zh) * 2023-07-25 2023-08-22 陕西欧卡电子智能科技有限公司 无人游船的自主航行控制方法及***
CN116817958B (zh) * 2023-08-29 2024-01-23 之江实验室 一种基于障碍物分组的参考路径生成方法、装置和介质
CN116817958A (zh) * 2023-08-29 2023-09-29 之江实验室 一种基于障碍物分组的参考路径生成方法、装置和介质
CN117288213A (zh) * 2023-08-30 2023-12-26 苏州大成运和智能科技有限公司 一种自适应的动态窗口局部路径规划方法
CN117075619B (zh) * 2023-10-17 2024-01-16 之江实验室 一种局部路径规划方法、装置和介质
CN117075619A (zh) * 2023-10-17 2023-11-17 之江实验室 一种局部路径规划方法、装置和介质
CN117782126A (zh) * 2023-12-25 2024-03-29 宋聪 高精地图引导的自动驾驶路径规划决策方法
CN117698769A (zh) * 2024-02-05 2024-03-15 上海鉴智其迹科技有限公司 自动驾驶的轨迹规划方法、装置、电子设备及存储介质
CN117698769B (zh) * 2024-02-05 2024-04-26 上海鉴智其迹科技有限公司 自动驾驶的轨迹规划方法、装置、电子设备及存储介质
CN117885764A (zh) * 2024-03-14 2024-04-16 中国第一汽车股份有限公司 车辆的轨迹规划方法、装置、车辆及存储介质
CN118107575A (zh) * 2024-04-30 2024-05-31 新石器中研(上海)科技有限公司 碰撞检查方法、控制装置、可读存储介质及驾驶设备

Also Published As

Publication number Publication date
CN112964271B (zh) 2023-03-31
CN112964271A (zh) 2021-06-15

Similar Documents

Publication Publication Date Title
WO2022193584A1 (zh) 一种面向多场景的自动驾驶规划方法及***
Badue et al. Self-driving cars: A survey
US11698263B2 (en) Safety and comfort constraints for navigation
CN106598055B (zh) 一种智能车局部路径规划方法及其装置、车辆
JP6969962B2 (ja) 車両の運転支援及び/又は走行制御のための地図情報提供システム
US11499834B2 (en) Aligning road information for navigation
US20170343374A1 (en) Vehicle navigation method and apparatus
Zhao et al. Dynamic motion planning for autonomous vehicle in unknown environments
Wang et al. Action annotated trajectory generation for autonomous maneuvers on structured road networks
Dolgov et al. Autonomous driving in semi-structured environments: Mapping and planning
CN109974739B (zh) 基于高精度地图的全局导航***及导航信息生成方法
CN111896004A (zh) 一种狭窄通道车辆轨迹规划方法及***
Fu et al. Model predictive trajectory optimization and tracking in highly constrained environments
CN115230719A (zh) 一种行驶轨迹规划方法和装置
Milanés et al. The tornado project: An automated driving demonstration in peri-urban and rural areas
Wang et al. Trajectory prediction for turning vehicles at intersections by fusing vehicle dynamics and driver’s future input estimation
US20190227552A1 (en) Vehicle control device
Zhong et al. CLAP: Cloud-and-learning-compatible autonomous driving platform
CN115246394A (zh) 一种智能车超车避障方法
Rosero et al. CNN-Planner: A neural path planner based on sensor fusion in the bird's eye view representation space for mapless autonomous driving
Liu et al. Campus guide: A lidar-based mobile robot
Xu et al. End-to-end autonomous driving based on image plane waypoint prediction
JP6964175B2 (ja) 演算装置、車載装置、自動運転システム
Bajić et al. Trajectory planning for autonomous vehicle using digital map
EP4068239A1 (en) Calculating device, vehicle-mounted device, and automated driving system

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

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

Country of ref document: EP

Kind code of ref document: A1