scholarly journals Real - Time Trajectory and Velocity Planning for Autonomous Vehicles

Author(s):  
Hrishikesh Dey ◽  
Rithika Ranadive ◽  
Abhishek Chaudhari

Path planning algorithm integrated with a velocity profile generation-based navigation system is one of the most important aspects of an autonomous driving system. In this paper, a real-time path planning solution to obtain a feasible and collision-free trajectory is proposed for navigating an autonomous car on a virtual highway. This is achieved by designing the navigation algorithm to incorporate a path planner for finding the optimal path, and a velocity planning algorithm for ensuring a safe and comfortable motion along the obtained path. The navigation algorithm was validated on the Unity 3D Highway-Simulated Environment for practical driving while maintaining velocity and acceleration constraints. The autonomous vehicle drives at the maximum specified velocity until interrupted by vehicular traffic, whereas then, the path planner, based on the various constraints provided by the simulator using µWebSockets, decides to either decelerate the vehicle or shift to a more secure lane. Subsequently, a splinebased trajectory generation for this path results in continuous and smooth trajectories. The velocity planner employs an analytical method based on trapezoidal velocity profile to generate velocities for the vehicle traveling along the precomputed path. To provide smooth control, an s-like trapezoidal profile is considered that uses a cubic spline for generating velocities for the ramp-up and ramp-down portions of the curve. The acceleration and velocity constraints, which are derived from road limitations and physical systems, are explicitly considered. Depending upon these constraints and higher module requirements (e.g., maintaining velocity, and stopping), an appropriate segment of the velocity profile is deployed. The motion profiles for all the use-cases are generated and verified graphically.

Author(s):  
Amr Mohamed ◽  
Moustafa El-Gindy ◽  
Jing Ren ◽  
Haoxiang Lang

This paper presents an optimal collision-free path planning algorithm of an autonomous multi-wheeled combat vehicle using optimal control theory and artificial potential field function (APF). The optimal path of the autonomous vehicle between a given starting and goal points is generated by an optimal path planning algorithm. The cost function of the path planning is solved together with vehicle dynamics equations to satisfy the vehicle dynamics constraints and the boundary conditions. For this purpose, a simplified four-axle bicycle model of the actual vehicle considering the vehicle body lateral and yaw dynamics while neglecting roll dynamics is used. The obstacle avoidance technique is mathematically modeled based on the proposed sigmoid function as the artificial potential field method. This potential function is assigned to each obstacle as a repulsive potential field. The inclusion of these potential fields results in a new APF which controls the steering angle of the autonomous vehicle to reach the goal point. A full nonlinear multi-wheeled combat vehicle model in TruckSim software is used for validation. This is done by importing the generated optimal path data from the introduced optimal path planning MATLAB algorithm and comparing lateral acceleration, yaw rate and curvature at different speeds (9 km/h, 28 km/h) for both simplified and TruckSim vehicle model. The simulation results show that the obtained optimal path for the autonomous multi-wheeled combat vehicle satisfies all vehicle dynamics constraints and successfully validated with TruckSim vehicle model.


2018 ◽  
Vol 8 (4) ◽  
pp. 35 ◽  
Author(s):  
Jörg Fickenscher ◽  
Sandra Schmidt ◽  
Frank Hannig ◽  
Mohamed Bouzouraa ◽  
Jürgen Teich

The sector of autonomous driving gains more and more importance for the car makers. A key enabler of such systems is the planning of the path the vehicle should take, but it can be very computationally burdensome finding a good one. Here, new architectures in ECU are required, such as GPU, because standard processors struggle to provide enough computing power. In this work, we present a novel parallelization of a path planning algorithm. We show how many paths can be reasonably planned under real-time requirements and how they can be rated. As an evaluation platform, an Nvidia Jetson board equipped with a Tegra K1 SoC was used, whose GPU is also employed in the zFAS ECU of the AUDI AG.


Sensors ◽  
2018 ◽  
Vol 19 (1) ◽  
pp. 20 ◽  
Author(s):  
Zheping Yan ◽  
Jiyun Li ◽  
Yi Wu ◽  
Gengshi Zhang

It is a challengeable task to plan multi-objective optimization paths for autonomous underwater vehicles (AUVs) in an unknown environments, which involves reducing travel time, shortening path length, keeping navigation safety, and smoothing trajectory. To address the above challenges, a real-time path planning approach combining particle swarm optimization and waypoint guidance is proposed for AUV in unknown oceanic environments in this paper. In this algorithm, a multi-beam forward looking sonar (FLS) is utilized to detect obstacles and the output data of FLS are used to produce those obstacles’ outlines (polygons). Particle swarm optimization is used to search for appropriate temporary waypoints, in which the optimization parameters of path planning are taken into account. Subsequently, an optimal path is automatically generated under the guidance of the destination and these temporary waypoints. Finally, three algorithms, including artificial potential field and genic algorithm, are adopted in the simulation experiments. The simulation results show that the proposed algorithm can generate the optimal paths compared with the other two algorithms.


Author(s):  
Nurul Saliha Amani Ibrahim ◽  
Faiz Asraf Saparudin

The path planning problem has been a crucial topic to be solved in autonomous vehicles. Path planning consists operations to find the route that passes through all of the points of interest in a given area. Several algorithms have been proposed and outlined in the various literature for the path planning of autonomous vehicle especially for unmanned aerial vehicles (UAV). The algorithms are not guaranteed to give full performance in each path planning cases but each one of them has their own specification which makes them suitable in sophisticated situation. This review paper evaluates several possible different path planning approaches of UAVs in terms optimal path, probabilistic completeness and computation time along with their application in specific problems.


Author(s):  
Prases K. Mohanty ◽  
Dayal R. Parhi

In this article a new optimal path planner for mobile robot navigation based on invasive weed optimization (IWO) algorithm has been addressed. This ecologically inspired algorithm is based on the colonizing property of weeds and distribution. A new fitness function has been formed between robot to goal and obstacles, which satisfied the conditions of both obstacle avoidance and target seeking behavior in robot present in the environment. Depending on the fitness function value of each weed in the colony the robot that avoids obstacles and navigating towards goal. The optimal path is generated with this developed algorithm when the robot reaches its destination. The effectiveness, feasibility, and robustness of the proposed navigational algorithm has been performed through a series of simulation and experimental results. The results obtained from the proposed algorithm has been also compared with other intelligent algorithms (Bacteria foraging algorithm and Genetic algorithm) to show the adaptability of the developed navigational method. Finally, it has been concluded that the proposed path planning algorithm can be effectively implemented in any kind of complex environments.


2021 ◽  
Vol 2128 (1) ◽  
pp. 012018
Author(s):  
Mohammed M S Ibrahim ◽  
Mostafa Rostom Atia ◽  
MW Fakhr

Abstract Path planning is vital in autonomous vehicle technology, from robots to self-driving cars and driverless trucks, it is impossible to navigate without a proper path planning algorithm, various algorithms exist Q-learning being one of them. Q-learning is used extensively in discrete applications as it is effective in finding solutions to these problems. This research investigates the possibility of using Q-learning for solving the local path planning problem with obstacle avoidance. Q-learning is split into two phases, the first being the training phase, and the second being the application phase. During training, Q-learning requires exponentially increasing training time based on the system’s state space. However, when Q-learning is applied it becomes as simple as a lookup table which allows it to run on even the simplest microcontrollers. Two simulations are conducted with varying environments. One to showcase the ability to learn the optimal path, the other to showcase the ability for learning navigation in variable environments. The first simulation was run on a static environment with one obstacle, with enough training episodes, Q-learning could solve the path planning problem with minimal movement steps. The second simulation focuses on a randomized environment, obstacles and the agent’s starting position are randomly chosen at the start of every episode. During testing, Q-learning was able to find a path to the target when a path did exist, as It was possible in certain configurations for the vehicle to be stuck in between obstacles with no feasible path or solution.


Sensors ◽  
2021 ◽  
Vol 21 (6) ◽  
pp. 2244
Author(s):  
S. M. Yang ◽  
Y. A. Lin

Safe path planning for obstacle avoidance in autonomous vehicles has been developed. Based on the Rapidly Exploring Random Trees (RRT) algorithm, an improved algorithm integrating path pruning, smoothing, and optimization with geometric collision detection is shown to improve planning efficiency. Path pruning, a prerequisite to path smoothing, is performed to remove the redundant points generated by the random trees for a new path, without colliding with the obstacles. Path smoothing is performed to modify the path so that it becomes continuously differentiable with curvature implementable by the vehicle. Optimization is performed to select a “near”-optimal path of the shortest distance among the feasible paths for motion efficiency. In the experimental verification, both a pure pursuit steering controller and a proportional–integral speed controller are applied to keep an autonomous vehicle tracking the planned path predicted by the improved RRT algorithm. It is shown that the vehicle can successfully track the path efficiently and reach the destination safely, with an average tracking control deviation of 5.2% of the vehicle width. The path planning is also applied to lane changes, and the average deviation from the lane during and after lane changes remains within 8.3% of the vehicle width.


2021 ◽  
Vol 9 (3) ◽  
pp. 252
Author(s):  
Yushan Sun ◽  
Xiaokun Luo ◽  
Xiangrui Ran ◽  
Guocheng Zhang

This research aims to solve the safe navigation problem of autonomous underwater vehicles (AUVs) in deep ocean, which is a complex and changeable environment with various mountains. When an AUV reaches the deep sea navigation, it encounters many underwater canyons, and the hard valley walls threaten its safety seriously. To solve the problem on the safe driving of AUV in underwater canyons and address the potential of AUV autonomous obstacle avoidance in uncertain environments, an improved AUV path planning algorithm based on the deep deterministic policy gradient (DDPG) algorithm is proposed in this work. This method refers to an end-to-end path planning algorithm that optimizes the strategy directly. It takes sensor information as input and driving speed and yaw angle as outputs. The path planning algorithm can reach the predetermined target point while avoiding large-scale static obstacles, such as valley walls in the simulated underwater canyon environment, as well as sudden small-scale dynamic obstacles, such as marine life and other vehicles. In addition, this research aims at the multi-objective structure of the obstacle avoidance of path planning, modularized reward function design, and combined artificial potential field method to set continuous rewards. This research also proposes a new algorithm called deep SumTree-deterministic policy gradient algorithm (SumTree-DDPG), which improves the random storage and extraction strategy of DDPG algorithm experience samples. According to the importance of the experience samples, the samples are classified and stored in combination with the SumTree structure, high-quality samples are extracted continuously, and SumTree-DDPG algorithm finally improves the speed of the convergence model. Finally, this research uses Python language to write an underwater canyon simulation environment and builds a deep reinforcement learning simulation platform on a high-performance computer to conduct simulation learning training for AUV. Data simulation verified that the proposed path planning method can guide the under-actuated underwater robot to navigate to the target without colliding with any obstacles. In comparison with the DDPG algorithm, the stability, training’s total reward, and robustness of the improved Sumtree-DDPG algorithm planner in this study are better.


Sensors ◽  
2021 ◽  
Vol 21 (2) ◽  
pp. 642
Author(s):  
Luis Miguel González de Santos ◽  
Ernesto Frías Nores ◽  
Joaquín Martínez Sánchez ◽  
Higinio González Jorge

Nowadays, unmanned aerial vehicles (UAVs) are extensively used for multiple purposes, such as infrastructure inspections or surveillance. This paper presents a real-time path planning algorithm in indoor environments designed to perform contact inspection tasks using UAVs. The only input used by this algorithm is the point cloud of the building where the UAV is going to navigate. The algorithm is divided into two main parts. The first one is the pre-processing algorithm that processes the point cloud, segmenting it into rooms and discretizing each room. The second part is the path planning algorithm that has to be executed in real time. In this way, all the computational load is in the first step, which is pre-processed, making the path calculation algorithm faster. The method has been tested in different buildings, measuring the execution time for different paths calculations. As can be seen in the results section, the developed algorithm is able to calculate a new path in 8–9 milliseconds. The developed algorithm fulfils the execution time restrictions, and it has proven to be reliable for route calculation.


Author(s):  
Jie Zhong ◽  
Tao Wang ◽  
Lianglun Cheng

AbstractIn actual welding scenarios, an effective path planner is needed to find a collision-free path in the configuration space for the welding manipulator with obstacles around. However, as a state-of-the-art method, the sampling-based planner only satisfies the probability completeness and its computational complexity is sensitive with state dimension. In this paper, we propose a path planner for welding manipulators based on deep reinforcement learning for solving path planning problems in high-dimensional continuous state and action spaces. Compared with the sampling-based method, it is more robust and is less sensitive with state dimension. In detail, to improve the learning efficiency, we introduce the inverse kinematics module to provide prior knowledge while a gain module is also designed to avoid the local optimal policy, we integrate them into the training algorithm. To evaluate our proposed planning algorithm in multiple dimensions, we conducted multiple sets of path planning experiments for welding manipulators. The results show that our method not only improves the convergence performance but also is superior in terms of optimality and robustness of planning compared with most other planning algorithms.


Sign in / Sign up

Export Citation Format

Share Document