Refine Your Search

Topic

Affiliation

Search Results

Technical Paper

Research on Artificial Potential Field based Soft Actor-Critic Algorithm for Roundabout Driving Decision

2024-04-09
2024-01-2871
Roundabouts are one of the most complex traffic environments in urban roads, and a key challenge for intelligent driving decision-making. Deep reinforcement learning, as an emerging solution for intelligent driving decisions, has the advantage of avoiding complex algorithm design and sustainable iteration. For the decision difficulty in roundabout scenarios, this paper proposes an artificial potential field based Soft Actor-Critic (APF-SAC) algorithm. Firstly, based on the Carla simulator and Gym framework, a reinforcement learning simulation system for roundabout driving is built. Secondly, to reduce reinforcement learning exploration difficulty, global path planning and path smoothing algorithms are designed to generate and optimize the path to guide the agent.
Technical Paper

Research on Vehicle Type Recognition Based on Improved YOLOv5 Algorithm

2024-04-09
2024-01-1992
As a key technology of intelligent transportation system, vehicle type recognition plays an important role in ensuring traffic safety,optimizing traffic management and improving traffic efficiency, which provides strong support for the development of modern society and the intelligent construction of traffic system. Aiming at the problems of large number of parameters, low detection efficiency and poor real-time performance in existing vehicle type recognition algorithms, this paper proposes an improved vehicle type recognition algorithm based on YOLOv5. Firstly, the lightweight network model MobileNet-V3 is used to replace the backbone feature extraction network CSPDarknet53 of the YOLOv5 model. The parameter quantity and computational complexity of the model are greatly reduced by replacing the standard convolution with the depthwise separable convolution, and enabled the model to maintain higher accuracy while having faster reasoning speed.
Technical Paper

A Method for Evaluating the Complexity of Autonomous Driving Road Scenes

2024-04-09
2024-01-1979
An autonomous vehicle is a comprehensive intelligent system that includes environment sensing, vehicle localization, path planning and decision-making control, of which environment sensing technology is a prerequisite for realizing autonomous driving. In the early days, vehicles sensed the surrounding environment through sensors such as cameras, radar, and lidar. With the development of 5G technology and the Vehicle-to-everything (V2X), other information from the roadside can also be received by vehicles. Such as traffic jam ahead, construction road occupation, school area, current traffic density, crowd density, etc. Such information can help the autonomous driving system understand the current driving environment more clearly. Vehicles are no longer limited to areas that can be sensed by sensors. Vehicles with different autonomous driving levels have different adaptability to the environment.
Technical Paper

A Precise Clamping Force Control Strategy for Electro-Mechanical Braking System Based on Nonlinear Characteristics Compensation

2024-04-09
2024-01-2322
Electro-Mechanical Braking (EMB) system, which completely abandons the traditional hydraulic device, realizes complete human-vehicle decoupling and integrates various functions without adding additional accessories, could meet the requirements of the future intelligent driving technology for high-quality braking control. However, there are significant internal interference of nonlinear characteristics such as mechanical friction and system variable stiffness during the actual working process of EMB, and these make the accuracy and rate of the clamping force control decline. This paper proposes a precise clamping force control strategy for EMB based on nonlinear characteristics compensation. First, we systematically analyze the working principle of EMB, and establish the mathematical model of EMB system including motor, transmission mechanism and friction. At the same time, some typical experiments are designed to identify internal parameters of friction model.
Technical Paper

Game-Theoretic Lane-Changing Decision-Making Methods for Highway On-ramp Merging Considering Driving Styles

2024-04-09
2024-01-2327
Driver's driving style has a great impact on lane changing behavior, especially in scenarios such as freeway on-ramps that contain a strong willingness to change lanes, both in terms of inter-vehicle interactions during lane changing and in terms of the driving styles of the two vehicles. This paper proposes a study on game-theoretic decision-making for lane-changing on highway on-ramps considering driving styles, aiming to facilitate safer and more efficient merging while adequately accounting for driving styles. Firstly, the six features proposed by the EXID dataset of lane-changing vehicles were subjected to Principal Component Analysis (PCA) and the three principal components after dimensionality reduction were extracted, and then clustered according to the principal components by the K-means algorithm. The parameters of lane-changing game payoffs are computed based on the clustering centers under several styles.
Technical Paper

Damping Force Optimal Control Strategy for Semi-Active Suspension System

2024-04-09
2024-01-2286
Semi-active suspension system (SASS) could enhance the ride comfort of the vehicle across different operating conditions through adjusting damping characteristics. However, current SASS are often calibrated based on engineering experience when selecting parameters for its controller, which complicates the achievement of optimal performance and leads to a decline in ride comfort for the vehicle being controlled. Linear quadratic constrained optimal control is a crucial tool for enhancing the performance of semi-active suspensions. It considers various performance objectives, such as ride comfort, handling stability, and driving safety. This study presents a control strategy for determining optimal damping force in SASS to enhance driving comfort. First, we analyze the working principle of the SASS and construct a seven-degree-of-freedom model.
Technical Paper

Energy Dissipation Characteristics Analysis of Automotive Vibration PID Control Based on Adaptive Differential Evolution Algorithm

2024-04-09
2024-01-2287
To address the issue of PID control for automotive vibration, this paper supplements and develops the evaluation of automotive vibration characteristics, and proposes a vibration response quantity for evaluating the energy dissipation characteristics of automotive vibration. A two-degree-of-freedom single wheel model for automotive vibration control is established, and the conventional vibration response variables for ride comfort evaluation and the energy consumption vibration response variables for energy dissipation characteristics evaluation are determined. This paper uses the Adaptive Differential Evolution (ADE) algorithm to tune the PID control parameters and introduces an adaptive mutation factor to improve the algorithm's adaptability. Several commonly used adaptive mutation factors are summarized in this paper, and their effects on algorithm improvement are compared.
Technical Paper

Road Feel Modeling and Return Control Strategy for Steer-by-Wire Systems

2024-04-09
2024-01-2316
The steer-by-wire (SBW) system, an integral component of the drive-by-wire chassis responsible for controlling the lateral motion of a vehicle, plays a pivotal role in enhancing vehicle safety. However, it poses a unique challenge concerning steering wheel return control, primarily due to its fundamental characteristic of severing the mechanical connection between the steering wheel and the turning wheel. This disconnect results in the inability to directly transmit the self-aligning torque to the steering wheel, giving rise to complications in ensuring a seamless return process. In order to realize precise control of steering wheel return, solving the problem of insufficient low-speed return and high-speed return overshoot of the steering wheel of the SBW system, this paper proposes a steering wheel active return control strategy for SBW system based on the backstepping control method.
Technical Paper

Digital Twin Based Multi-Vehicle Cooperative Warning System on Mountain Roads

2024-04-09
2024-01-1999
Compared with urban areas, the road surface in mountainous areas generally has a larger slope, larger curvature and narrower width, and the vehicle may roll over and other dangers on such a road. In the case of limited driver information, if the two cars on the mountain road approach fast, it is very likely to occur road blockage or even collision. Multi-vehicle cooperative control technology can integrate the driving data of nearby vehicles, expand the perception range of vehicles, assist driving through multi-objective optimization algorithm, and improve the driving safety and traffic system reliability. Most existing studies on cooperative control of multiple vehicles is mainly focused on urban areas with stable environment, while ignoring complex conditions in mountainous areas and the influence of driver status. In this study, a digital twin based multi-vehicle cooperative warning system was proposed to improve the safety of multiple vehicles on mountain roads.
Technical Paper

Research on Garbage Recognition of Road Cleaning Vehicle Based on Improved YOLOv5 Algorithm

2024-04-09
2024-01-2003
As a key tool to maintain urban cleanliness and improve the road environment, road cleaning vehicles play an important role in improving the quality of life of residents. However, the traditional road cleaning vehicle requires the driver to monitor the situation of road garbage at all times and manually operate the cleaning process, resulting in an increase in the driver 's work intensity. To solve this problem, this paper proposes a road garbage recognition algorithm based on improved YOLOv5, which aims to reduce labor consumption and improve the efficiency of road cleaning. Firstly, the lightweight network MobileNet-V3 is used to replace the backbone feature extraction network of the YOLOv5 model. The number of parameters and computational complexity of the model are greatly reduced by replacing the standard convolution with the deep separable convolution, which enabled the model to have faster reasoning speed while maintaining higher accuracy.
Technical Paper

Fuzzy Control of Regenerative Braking on Pure Electric Garbage Truck Based on Particle Swarm Optimization

2024-04-09
2024-01-2145
To improve the braking energy recovery rate of pure electric garbage removal vehicles and ensure the braking effect of garbage removal vehicles, a strategy using particle swarm algorithm to optimize the regenerative braking fuzzy control of garbage removal vehicles is proposed. A multi-section front and rear wheel braking force distribution curve is designed considering the braking effect and braking energy recovery. A hierarchical regenerative braking fuzzy control strategy is established based on the braking force and braking intensity required by the vehicle. The first layer is based on the braking force required by the vehicle, based on the front and rear axle braking force distribution plan, and uses fuzzy controllers.
Technical Paper

Comparative Analysis of Clustering Algorithms Based on Driver Steering Characteristics

2024-04-09
2024-01-2570
Driver steering feature clustering aims to understand driver behavior and the decision-making process through the analysis of driver steering data. It seeks to comprehend various steering characteristics exhibited by drivers, providing valuable insights into road safety, driver assistance systems, and traffic management. The primary objective of this study is to thoroughly explore the practical applications of various clustering algorithms in processing driver steering data and to compare their performance and applicability. In this paper, principal component analysis was employed to reduce the dimension of the selected steering feature parameters. Subsequently, K-means, fuzzy C-means, the density-based spatial clustering algorithm, and other algorithms were used for clustering analysis, and finally, the Calinski-Harabasz index was employed to evaluate the clustering results. Furthermore, the driver steering features were categorized into lateral and longitudinal categories.
Technical Paper

Improve the Durability and Maintenance Feasibility of the Universal Joint Based on the Original Half-Shaft Foundation

2024-04-09
2024-01-2441
Based on the particularity of the racing field of the Baja SAE China, the Baja Racing Team of our university has adopted rzeppa universal joint for vehicle design and field competition in the semi-axle parts of the race car in previous years. In view of the complex conditions of the Baja Competition, such as gravity test, climb test, handling test, endurance test, etc., it is necessary to optimize and develop a more convenient maintenance model. Installation and use of better performance, more suitable for off-road conditions of the shaft. In this paper, based on the development dynamics of automobile axles and the transverse comparison of various axles, a kind of telescopic cross-shaft universal joint axles is designed by using CATIA software to model and simulate kinematics and dynamics by using ANSYS software. At the same time, the stress and strain of the model are continuously optimized according to the change of axle wheel Angle and the torque matching of Baja Racing.
Technical Paper

Spatio-Temporal Trajectory Planning Using Search And Optimizing Method for Autonomous Driving

2024-04-09
2024-01-2563
In the field of autonomous driving trajectory planning, it’s virtual to ensure real-time planning while guaranteeing feasibility and robustness. Current widely adopted approaches include decoupling path planning and velocity planning based on optimization method, which can’t always yield optimal solutions, especially in complex dynamic scenarios. Furthermore, search-based and sampling-based solutions encounter limitations due to their low resolution and high computational costs. This paper presents a novel spatio-temporal trajectory planning approach that integrates both search-based planning and optimization-based planning method. This approach retains the advantages of search-based method, allowing for the identification of a global optimal solution through search. To address the challenge posed by the non-convex nature of the original solution space, we introduce a spatio-temporal semantic corridor structure, which constructs a convex feasible set for the problem.
Technical Paper

Vehicle Trajectory Planning and Control Based on Bi-Level Model Predictive Control Algorithm

2024-04-09
2024-01-2561
Autonomous driving technology represents a significant direction for future transportation, encompassing four key aspects: perception, planning, decision-making, and control. Among these aspects, vehicle trajectory planning and control are crucial for achieving safe and efficient autonomous driving. This paper introduces a Combined Model Predictive Control algorithm aimed at ensuring collision-free and comfortable driving while adhering to appropriate lane trajectories. Due to the algorithm is divided into two layers, it is also called the Bi-Level Model Predictive Control algorithm (BLMPC). The BLMPC algorithm comprises two layers. The upper-level trajectory planner, to reduce planning time, employs a point mass model that neglects the vehicle's physical dimensions as the planning model. Additionally, obstacle avoidance cost functions are integrated into the planning process.
Technical Paper

Research on Lane-Changing Trajectory Planning for Autonomous Driving Considering Longitudinal Interaction

2024-04-09
2024-01-2557
Autonomous driving in real-world urban traffic must cope with dynamic environments. This presents a challenging decision-making problem, e.g. deciding when to perform an overtaking maneuver or how to safely merge into traffic. The traditional autonomous driving algorithm framework decouples prediction and decision-making, which means that the decision-making and planning tasks will be carried out after the prediction task is over. The disadvantage of this approach is that it does not consider the possible impact of ego vehicle decisions on the future states of other agents. In this article, a decision-making and planning method which considers longitudinal interaction is represented. The method’s architecture is mainly composed of the following parts: trajectory sampling, forward simulation, trajectory scoring and trajectory selection. For trajectory sampling, a lattice planner is used to sample three-dimensionally in both the time horizon and the space horizon.
Technical Paper

Research on Design of Electric Vehicle Sound Synthesis Based on Frequency Shift Algorithm

2024-04-09
2024-01-2335
The active sound generation systems (ASGS) for electric vehicles (EVs) play an important role in improving sound perception and transmission in the car, and can meet the needs of different user groups for driving and riding experiences. The active sound synthesis algorithm is the core part of ASGS. This paper uses an efficient variable-range fast linear interpolation method to design a frequency-shifted and pitch-modified sound synthesis algorithm. By obtaining the operating parameters of EVs, such as vehicle speed, motor speed, pedal opening, etc., the original sound signal is interpolated to varying degrees to change the frequency of the sound signal, and then the amplitude of the sound signal is determined according to different driving states. This simulates an effect similar to the sound of a traditional car engine. Then, a dynamic superposition strategy is proposed based on the Hann window function.
Technical Paper

Research on Trajectory Tracking of Autonomous Vehicle Based on Lateral and Longitudinal Cooperative Control

2024-03-29
2024-01-5039
Autonomous vehicles require the collaborative operation of multiple modules during their journey, and enhancing tracking performance is a key focus in the field of planning and control. To address this challenge, we propose a cooperative control strategy, which is designed based on the integration of model predictive control (MPC) and a dual proportional–integral–derivative approach, referred to as collaborative control of MPC and double PID (CMDP for short in this article).The CMDP controller accomplishes the execution of actions based on information from perception and planning modules. For lateral control, the MPC algorithm is employed, transforming the MPC’s optimal problem into a standard quadratic programming problem. Simultaneously, a fuzzy control is designed to achieve adaptive changes in the constraint values for steering angles.
Technical Paper

TD3 Tuned PID Controller for Autonomous Vehicle Platooning

2023-12-31
2023-01-7108
The main objective of platoon control is coordinated motion of autonomous vehicle platooning with small intervehicle spacing while maintaining the same speed and acceleration as the leading vehicle, which can save energy consumption and improve traffic throughput. The conventional platoon control methods are confronted with the problem of manual parameter tuning. In order to addres this isue, a novel bifold platoon control approach leveraging a deep reinforcement learning-based model is proposed, which enables the platoon adapt to the complex traffic environment, and guarantees the safety of platoon. The upper layer controller based on the TD3 tuned PID algorithm outputs the desired acceleration. This integration mitigates the inconvenience of frequent manual parameter tuning asociated with the conventional PID algorithm. The lower layer controller tracks the desired acceleration based on the inverse vehicle dynamics model and feedback control.
X