Sign in to use this feature.

Years

Between: -

Subjects

remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline

Journals

Article Types

Countries / Regions

Search Results (26)

Search Parameters:
Keywords = off-road navigation

Order results
Result details
Results per page
Select all
Export citation of selected articles as:
20 pages, 28459 KB  
Article
An Efficient Autonomous Exploration Framework for Autonomous Vehicles in Uneven Off-Road Environments
by Le Wang, Yao Qi, Binbing He and Youchun Xu
Drones 2025, 9(7), 490; https://doi.org/10.3390/drones9070490 - 11 Jul 2025
Viewed by 501
Abstract
Autonomous exploration of autonomous vehicles in off-road environments remains challenging due to the adverse impact on exploration efficiency and safety caused by uneven terrain. In this paper, we propose a path planning framework for autonomous exploration to obtain feasible and smooth paths for [...] Read more.
Autonomous exploration of autonomous vehicles in off-road environments remains challenging due to the adverse impact on exploration efficiency and safety caused by uneven terrain. In this paper, we propose a path planning framework for autonomous exploration to obtain feasible and smooth paths for autonomous vehicles in 3D off-road environments. In our framework, we design a target selection strategy based on 3D terrain traversability analysis, and the traversability is evaluated by integrating vehicle dynamics with geometric indicators of the terrain. This strategy detects the frontiers within 3D environments and utilizes the traversability cost of frontiers as the pivotal weight within the clustering process, ensuring the accessibility of candidate points. Additionally, we introduced a more precise approach to evaluate navigation costs in off-road terrain. To obtain a smooth local path, we generate a cluster of local paths based on the global path and evaluate the optimal local path through the traversability and smoothness of the path. The method is validated in simulations and real-world environments based on representative off-road scenarios. The results demonstrate that our method reduces the exploration time by up to 36.52% and ensures the safety of the vehicle while exploring unknown 3D off-road terrain compared with state-of-the-art methods. Full article
Show Figures

Figure 1

24 pages, 4937 KB  
Article
Performance Improvement of Pure Pursuit Algorithm via Online Slip Estimation for Off-Road Tracked Vehicle
by Çağıl Çiloğlu and Emir Kutluay
Sensors 2025, 25(14), 4242; https://doi.org/10.3390/s25144242 - 8 Jul 2025
Viewed by 661
Abstract
The motion control of a tracked mobile robot remains an important capability for autonomous navigation. Kinematic path-tracking algorithms are commonly used in mobile robotics due to their ease of implementation and real-time computational cost advantage. This paper integrates an extended Kalman filter (EKF) [...] Read more.
The motion control of a tracked mobile robot remains an important capability for autonomous navigation. Kinematic path-tracking algorithms are commonly used in mobile robotics due to their ease of implementation and real-time computational cost advantage. This paper integrates an extended Kalman filter (EKF) into a common kinematic controller for path-tracking performance improvement. The extended Kalman filter estimates the instantaneous center of rotation (ICR) of tracks using the sensor readings of GPS and IMU. These ICR estimations are then given as input to the motion control algorithm to generate the track velocity demands. The platform to be controlled is a heavyweight off-road tracked vehicle, which necessitates the investigation of slip values. A high-fidelity simulation model, which is verified with field tests, is used as the plant in the path-tracking simulations. The performance of the filter and the algorithm is also demonstrated in field tests on a stabilized road. The field results show that the proposed estimation increases the path-tracking accuracy significantly (about 44%) compared to the classical pure pursuit. Full article
(This article belongs to the Special Issue INS/GNSS Integrated Navigation Systems)
Show Figures

Figure 1

28 pages, 9666 KB  
Article
An Efficient Path Planning Algorithm Based on Delaunay Triangular NavMesh for Off-Road Vehicle Navigation
by Ting Tian, Huijing Wu, Haitao Wei, Fang Wu and Jiandong Shang
World Electr. Veh. J. 2025, 16(7), 382; https://doi.org/10.3390/wevj16070382 - 7 Jul 2025
Viewed by 518
Abstract
Off-road path planning involves navigating vehicles through areas lacking established road networks, which is critical for emergency response in disaster events, but is limited by the complex geographical environments in natural conditions. How to model the vehicle’s off-road mobility effectively and represent environments [...] Read more.
Off-road path planning involves navigating vehicles through areas lacking established road networks, which is critical for emergency response in disaster events, but is limited by the complex geographical environments in natural conditions. How to model the vehicle’s off-road mobility effectively and represent environments is critical for efficient path planning in off-road environments. This paper proposed an improved A* path planning algorithm based on a Delaunay triangular NavMesh model with off-road environment representation. Firstly, a land cover off-road mobility model is constructed to determine the navigable regions by quantifying the mobility of different geographical factors. This model maps passable areas by considering factors such as slope, elevation, and vegetation density and utilizes morphological operations to minimize mapping noise. Secondly, a Delaunay triangular NavMesh model is established to represent off-road environments. This mesh leverages Delaunay triangulation’s empty circle and maximum-minimum angle properties, which accurately represent irregular obstacles without compromising computational efficiency. Finally, an improved A* path planning algorithm is developed to find the optimal off-road mobility path from a start point to an end point, and identify a path triangle chain with which to calculate the shortest path. The improved road-off path planning A* algorithm proposed in this paper, based on the Delaunay triangulation navigation mesh, uses the Euclidean distance between the midpoint of the input edge and the midpoint of the output edge as the cost function g(n), and the Euclidean distance between the centroids of the current triangle and the goal as the heuristic function h(n). Considering that the improved road-off path planning A* algorithm could identify a chain of path triangles for calculating the shortest path, the funnel algorithm was then introduced to transform the path planning problem into a dynamic geometric problem, iteratively approximating the optimal path by maintaining an evolving funnel region, obtaining a shortest path closer to the Euclidean shortest path. Research results indicate that the proposed algorithms yield optimal path-planning results in terms of both time and distance. The navigation mesh-based path planning algorithm saves 5~20% of path length than hexagonal and 8-directional grid algorithms used widely in previous research by using only 1~60% of the original data loading. In general, the path planning algorithm is based on a national-level navigation mesh model, validated at the national scale through four cases representing typical natural and social landscapes in China. Although the algorithms are currently constrained by the limited data accessibility reflecting real-time transportation status, these findings highlight the generalizability and efficiency of the proposed off-road path-planning algorithm, which is useful for path-planning solutions for emergency operations, wilderness adventures, and mineral exploration. Full article
Show Figures

Figure 1

22 pages, 3431 KB  
Article
Safety–Efficiency Balanced Navigation for Unmanned Tracked Vehicles in Uneven Terrain Using Prior-Based Ensemble Deep Reinforcement Learning
by Yiming Xu, Songhai Zhu, Dianhao Zhang, Yinda Fang and Mien Van
World Electr. Veh. J. 2025, 16(7), 359; https://doi.org/10.3390/wevj16070359 - 27 Jun 2025
Viewed by 383
Abstract
This paper proposes a novel navigation approach for Unmanned Tracked Vehicles (UTVs) using prior-based ensemble deep reinforcement learning, which fuses the policy of the ensemble Deep Reinforcement Learning (DRL) and Dynamic Window Approach (DWA) to enhance both exploration efficiency and deployment safety in [...] Read more.
This paper proposes a novel navigation approach for Unmanned Tracked Vehicles (UTVs) using prior-based ensemble deep reinforcement learning, which fuses the policy of the ensemble Deep Reinforcement Learning (DRL) and Dynamic Window Approach (DWA) to enhance both exploration efficiency and deployment safety in unstructured off-road environments. First, by integrating kinematic analysis, we introduce a novel state and an action space that account for rugged terrain features and track–ground interactions. Local elevation information and vehicle pose changes over consecutive time steps are used as inputs to the DRL model, enabling the UTVs to implicitly learn policies for safe navigation in complex terrains while minimizing the impact of slipping disturbances. Then, we introduce an ensemble Soft Actor–Critic (SAC) learning framework, which introduces the DWA as a behavioral prior, referred to as the SAC-based Hybrid Policy (SAC-HP). Ensemble SAC uses multiple policy networks to effectively reduce the variance of DRL outputs. We combine the DRL actions with the DWA method by reconstructing the hybrid Gaussian distribution of both. Experimental results indicate that the proposed SAC-HP converges faster than traditional SAC models, which enables efficient large-scale navigation tasks. Additionally, a penalty term in the reward function about energy optimization is proposed to reduce velocity oscillations, ensuring fast convergence and smooth robot movement. Scenarios with obstacles and rugged terrain have been considered to prove the SAC-HP’s efficiency, robustness, and smoothness when compared with the state of the art. Full article
Show Figures

Figure 1

38 pages, 9310 KB  
Review
From ADAS to Material-Informed Inspection: Review of Hyperspectral Imaging Applications on Mobile Ground Robots
by Daniil Valme, Anton Rassõlkin and Dhanushka C. Liyanage
Sensors 2025, 25(8), 2346; https://doi.org/10.3390/s25082346 - 8 Apr 2025
Cited by 1 | Viewed by 1733
Abstract
Hyperspectral imaging (HSI) has evolved from its origins in space missions to become a promising sensing technology for mobile ground robots, offering unique capabilities in material identification and scene understanding. This review examines the integration and applications of HSI systems in ground-based mobile [...] Read more.
Hyperspectral imaging (HSI) has evolved from its origins in space missions to become a promising sensing technology for mobile ground robots, offering unique capabilities in material identification and scene understanding. This review examines the integration and applications of HSI systems in ground-based mobile platforms, with emphasis on outdoor implementations. The analysis covers recent developments in two main application domains: autonomous navigation and inspection tasks. In navigation, the review explores HSI applications in Advanced Driver Assistance Systems (ADAS) and off-road scenarios, examining how spectral information enhances environmental perception and decision making. For inspection applications, the investigation covers HSI deployment in search and rescue operations, mining exploration, and infrastructure monitoring. The review addresses key technical aspects including sensor types, acquisition modes, and platform integration challenges, particularly focusing on environmental factors affecting outdoor HSI deployment. Additionally, it analyzes available datasets and annotation approaches, highlighting their significance for developing robust classification algorithms. While recent advances in sensor design and processing capabilities have expanded HSI applications, challenges remain in real-time processing, environmental robustness, and system cost. The review concludes with a discussion of future research directions and opportunities for advancing HSI technology in mobile robotics applications. Full article
Show Figures

Figure 1

16 pages, 13516 KB  
Article
DUnE: A Versatile Dynamic Unstructured Environment for Off-Road Navigation
by Jack M. Vice and Gita Sukthankar
Robotics 2025, 14(4), 35; https://doi.org/10.3390/robotics14040035 - 21 Mar 2025
Cited by 1 | Viewed by 1541
Abstract
Navigating uneven, unstructured terrain with dynamic obstacles remains a challenge for autonomous mobile robots. This article introduces Dynamic Unstructured Environment (DUnE) for evaluating the performance of off-road navigation systems in simulation. DUnE is a versatile software framework that implements the [...] Read more.
Navigating uneven, unstructured terrain with dynamic obstacles remains a challenge for autonomous mobile robots. This article introduces Dynamic Unstructured Environment (DUnE) for evaluating the performance of off-road navigation systems in simulation. DUnE is a versatile software framework that implements the Gymnasium reinforcement learning (RL) interface for ROS 2, incorporating unstructured Gazebo simulation environments and dynamic obstacle integration to advance off-road navigation research. The testbed automates key performance metric logging and provides semi-automated trajectory generation for dynamic obstacles including simulated human actors. It supports multiple robot platforms and five distinct unstructured environments, ranging from forests to rocky terrains. A baseline reinforcement learning agent demonstrates the framework’s effectiveness by performing pointgoal navigation with obstacle avoidance across various terrains. By providing an RL interface, dynamic obstacle integration, specialized navigation tasks, and comprehensive metric tracking, DUnE addresses significant gaps in existing simulation tools. Full article
(This article belongs to the Section AI in Robotics)
Show Figures

Figure 1

25 pages, 16833 KB  
Article
R2SCAT-LPR: Rotation-Robust Network with Self- and Cross-Attention Transformers for LiDAR-Based Place Recognition
by Weizhong Jiang, Hanzhang Xue, Shubin Si, Liang Xiao, Dawei Zhao, Qi Zhu, Yiming Nie and Bin Dai
Remote Sens. 2025, 17(6), 1057; https://doi.org/10.3390/rs17061057 - 17 Mar 2025
Cited by 1 | Viewed by 786
Abstract
LiDAR-based place recognition (LPR) is crucial for the navigation and localization of autonomous vehicles and mobile robots in large-scale outdoor environments and plays a critical role in loop closure detection for simultaneous localization and mapping (SLAM). Existing LPR methods, which utilize 2D bird’s-eye [...] Read more.
LiDAR-based place recognition (LPR) is crucial for the navigation and localization of autonomous vehicles and mobile robots in large-scale outdoor environments and plays a critical role in loop closure detection for simultaneous localization and mapping (SLAM). Existing LPR methods, which utilize 2D bird’s-eye view (BEV) projections of 3D point clouds, achieve competitive performance in efficiency and recognition accuracy. However, these methods often struggle with capturing global contextual information and maintaining robustness to viewpoint variations. To address these challenges, we propose R2SCAT-LPR, a novel, transformer-based model that leverages self-attention and cross-attention mechanisms to extract rotation-robust place feature descriptors from BEV images. R2SCAT-LPR consists of three core modules: (1) R2MPFE, which employs weight-shared cascaded multi-head self-attention (MHSA) to extract multi-level spatial contextual patch features from both the original BEV image and its randomly rotated counterpart; (2) DSCA, which integrates dual-branch self-attention and multi-head cross-attention (MHCA) to capture intrinsic correspondences between multi-level patch features before and after rotation, enhancing the extraction of rotation-robust local features; and (3) a combined NetVLAD module, which aggregates patch features from both the original feature space and the rotated interaction space into a compact and viewpoint-robust global descriptor. Extensive experiments conducted on the KITTI and NCLT datasets validate the effectiveness of the proposed model, demonstrating its robustness to rotation variations and its generalization ability across diverse scenes and LiDAR sensors types. Furthermore, we evaluate the generalization performance and computational efficiency of R2SCAT-LPR on our self-constructed OffRoad-LPR dataset for off-road autonomous driving, verifying its deployability on resource-constrained platforms. Full article
Show Figures

Figure 1

23 pages, 12001 KB  
Article
Enhancing Off-Road Topography Estimation by Fusing LIDAR and Stereo Camera Data with Interpolated Ground Plane
by Gustav Sten, Lei Feng and Björn Möller
Sensors 2025, 25(2), 509; https://doi.org/10.3390/s25020509 - 16 Jan 2025
Cited by 2 | Viewed by 1262
Abstract
Topography estimation is essential for autonomous off-road navigation. Common methods rely on point cloud data from, e.g., Light Detection and Ranging sensors (LIDARs) and stereo cameras. Stereo cameras produce dense point clouds with larger coverage but lower accuracy. LIDARs, on the other hand, [...] Read more.
Topography estimation is essential for autonomous off-road navigation. Common methods rely on point cloud data from, e.g., Light Detection and Ranging sensors (LIDARs) and stereo cameras. Stereo cameras produce dense point clouds with larger coverage but lower accuracy. LIDARs, on the other hand, have higher accuracy and longer range but much less coverage. LIDARs are also more expensive. The research question examines whether incorporating LIDARs can significantly improve stereo camera accuracy. Current sensor fusion methods use LIDARs’ raw measurements directly; thus, the improvement in estimation accuracy is limited to only LIDAR-scanned locations The main contribution of our new method is to construct a reference ground plane through the interpolation of LIDAR data so that the interpolated maps have similar coverage as the stereo camera’s point cloud. The interpolated maps are fused with the stereo camera point cloud via Kalman filters to improve a larger section of the topography map. The method is tested in three environments: controlled indoor, semi-controlled outdoor, and unstructured terrain. Compared to the existing method without LIDAR interpolation, the proposed approach reduces average error by 40% in the controlled environment and 67% in the semi-controlled environment, while maintaining large coverage. The unstructured environment evaluation confirms its corrective impact. Full article
Show Figures

Figure 1

26 pages, 548 KB  
Systematic Review
A Systematic Review of Cutting-Edge Radar Technologies: Applications for Unmanned Ground Vehicles (UGVs)
by Can Ersü, Eduard Petlenkov and Karl Janson
Sensors 2024, 24(23), 7807; https://doi.org/10.3390/s24237807 - 6 Dec 2024
Cited by 3 | Viewed by 3589
Abstract
This systematic review evaluates the integration of advanced radar technologies into unmanned ground vehicles (UGVs), focusing on their role in enhancing autonomy in defense, transportation, and exploration. A comprehensive search across IEEE Xplore, Google Scholar, arXiv, and Scopus identified relevant studies from 2007 [...] Read more.
This systematic review evaluates the integration of advanced radar technologies into unmanned ground vehicles (UGVs), focusing on their role in enhancing autonomy in defense, transportation, and exploration. A comprehensive search across IEEE Xplore, Google Scholar, arXiv, and Scopus identified relevant studies from 2007 to 2024. The studies were screened, and 54 were selected for full analysis based on inclusion criteria. The review details advancements in radar perception, machine learning integration, and sensor fusion while also discussing the challenges of radar deployment in complex environments. The findings reveal both the potential and limitations of radar technology in UGVs, particularly in adverse weather and unstructured terrains. The implications for practice, policy, and future research are outlined. Full article
(This article belongs to the Section Radar Sensors)
Show Figures

Figure 1

16 pages, 34354 KB  
Article
Autonomous Vehicles Traversability Mapping Fusing Semantic–Geometric in Off-Road Navigation
by Bo Zhang, Weili Chen, Chaoming Xu, Jinshi Qiu and Shiyu Chen
Drones 2024, 8(9), 496; https://doi.org/10.3390/drones8090496 - 18 Sep 2024
Cited by 2 | Viewed by 2714
Abstract
This paper proposes an evaluating and mapping methodology of terrain traversability for off-road navigation of autonomous vehicles in unstructured environments. Terrain features are extracted from RGB images and 3D point clouds to create a traversal cost map. The cost map is then employed [...] Read more.
This paper proposes an evaluating and mapping methodology of terrain traversability for off-road navigation of autonomous vehicles in unstructured environments. Terrain features are extracted from RGB images and 3D point clouds to create a traversal cost map. The cost map is then employed to plan safe trajectories. Bayesian generalized kernel inference is employed to assess unknown grid attributes due to the sparse raw point cloud data. A Kalman filter also creates density local elevation maps in real time by fusing multiframe information. Consequently, the terrain semantic mapping procedure considers the uncertainty of semantic segmentation and the impact of sensor noise. A Bayesian filter is used to update the surface semantic information in a probabilistic manner. Ultimately, the elevation map is utilized to extract geometric characteristics, which are then integrated with the probabilistic semantic map. This combined map is then used in conjunction with the extended motion primitive planner to plan the most effective trajectory. The experimental results demonstrate that the autonomous vehicles obtain a success rate enhancement ranging from 4.4% to 13.6% and a decrease in trajectory roughness ranging from 5.1% to 35.8% when compared with the most developed outdoor navigation algorithms. Additionally, the autonomous vehicles maintain a terrain surface selection accuracy of over 85% during the navigation process. Full article
Show Figures

Figure 1

13 pages, 17412 KB  
Article
Geometric Fidelity Requirements for Meshes in Automotive Lidar Simulation
by Christopher Goodin, Marc N. Moore, Daniel W. Carruth, Zachary Aspin and John Kaniarz
Virtual Worlds 2024, 3(3), 270-282; https://doi.org/10.3390/virtualworlds3030014 - 3 Jul 2024
Viewed by 1335
Abstract
The perception of vegetation is a critical aspect of off-road autonomous navigation, and consequentially a critical aspect of the simulation of autonomous ground vehicles (AGVs). Representing vegetation with triangular meshes requires detailed geometric modeling that captures the intricacies of small branches and leaves. [...] Read more.
The perception of vegetation is a critical aspect of off-road autonomous navigation, and consequentially a critical aspect of the simulation of autonomous ground vehicles (AGVs). Representing vegetation with triangular meshes requires detailed geometric modeling that captures the intricacies of small branches and leaves. In this work, we propose to answer the question, “What degree of geometric fidelity is required to realistically simulate lidar in AGV simulations?” To answer this question, in this work we present an analysis that determines the required geometric fidelity of digital scenes and assets used in the simulation of AGVs. Focusing on vegetation, we use a comparison of the real and simulated perceived distribution of leaf orientation angles in lidar point clouds to determine the number of triangles required to reliably reproduce realistic results. By comparing real lidar scans of vegetation to simulated lidar scans of vegetation with a variety of geometric fidelities, we find that digital tree models (meshes) need to have a minimum triangle density of >1600 triangles per cubic meter in order to accurately reproduce the geometric properties of lidar scans of real vegetation, with a recommended triangle density of 11,000 triangles per cubic meter for best performance. Furthermore, by comparing these experiments to past work investigating the same question for cameras, we develop a general “rule-of-thumb” for vegetation mesh fidelity in AGV sensor simulation. Full article
Show Figures

Figure 1

23 pages, 5821 KB  
Article
Optimizing Charging Pad Deployment by Applying a Quad-Tree Scheme
by Rei-Heng Cheng, Chang-Wu Yu and Zuo-Li Zhang
Algorithms 2024, 17(6), 264; https://doi.org/10.3390/a17060264 - 14 Jun 2024
Cited by 3 | Viewed by 1124
Abstract
The recent advancement in wireless power transmission (WPT) has led to the development of wireless rechargeable sensor networks (WRSNs), since this technology provides a means to replenish sensor nodes wirelessly, offering a solution to the energy challenges faced by WSNs. Most of the [...] Read more.
The recent advancement in wireless power transmission (WPT) has led to the development of wireless rechargeable sensor networks (WRSNs), since this technology provides a means to replenish sensor nodes wirelessly, offering a solution to the energy challenges faced by WSNs. Most of the recent previous work has focused on charging sensor nodes using wireless charging vehicles (WCVs) equipped with high-capacity batteries and WPT devices. In these schemes, a vehicle can move close to a sensor node and wirelessly charge it without physical contact. While these schemes can mitigate the energy problem to some extent, they overlook two primary challenges of applied WCVs: off-road navigation and vehicle speed limitations. To overcome these challenges, previous work proposed a new WRSN model equipped with one drone coupled with several pads deployed to charge the drone when it cannot reach the subsequent stop. This wireless charging pad deployment aims to deploy the minimum number of pads so that at least one feasible routing path from the base station can be established for the drone to reach every SN in a given WRSN. The major weakness of previous studies is that they only consider deploying a wireless charging pad at the locations of the wireless sensor nodes. Their schemes are limited and constrained because usually every point in the deployed area can be considered to deploy a pad. Moreover, the deployed pads suggested by these schemes may not be able to meet the connected requirements due to sparse environments. In this work, we introduce a new scheme that utilizes the Quad-Tree concept to address the wireless charging pad deployment problem and reduce the number of deployed pads at the same time. Extensive simulations were conducted to illustrate the merits of the proposed schemes by comparing them with different previous schemes on maps of varying sizes. In the case of large maps, the proposed schemes surpassed all previous works, indicating that our approach is more suitable for large-scale network environments. Full article
(This article belongs to the Collection Feature Paper in Algorithms and Complexity Theory)
Show Figures

Graphical abstract

23 pages, 12524 KB  
Article
A Path-Planning Approach for an Unmanned Vehicle in an Off-Road Environment Based on an Improved A* Algorithm
by Gaoyang Xie, Liqing Fang, Xujun Su, Deqing Guo, Ziyuan Qi, Yanan Li and Jinli Che
World Electr. Veh. J. 2024, 15(6), 234; https://doi.org/10.3390/wevj15060234 - 29 May 2024
Cited by 7 | Viewed by 1672
Abstract
Path planning for an unmanned vehicle in an off-road uncertain environment is important for navigation safety and efficiency. Regarding this, a global improved A* algorithm is presented. Firstly, based on remote sensing images, the artificial potential field method is used to describe the [...] Read more.
Path planning for an unmanned vehicle in an off-road uncertain environment is important for navigation safety and efficiency. Regarding this, a global improved A* algorithm is presented. Firstly, based on remote sensing images, the artificial potential field method is used to describe the distribution of risk in the uncertain environment, and all types of ground conditions are converted into travel time costs. Additionally, the improvements of the A* algorithm include a multi-directional node search algorithm, and a new line-of-sight algorithm is designed which can search sub-nodes more accurately, while the risk factor and the passing-time cost factor are added to the cost function. Finally, three kinds of paths can be calculated, including the shortest path, the path of less risk, and the path of less time-cost. The results of the simulation show that the improved A* algorithm is suitable for the path planning of unmanned vehicles in a complex and uncertain environment. The effectiveness of the algorithm is verified by the comparison between the simulation and the actual condition verification. Full article
Show Figures

Figure 1

17 pages, 3981 KB  
Article
Real-Time Segmentation of Unstructured Environments by Combining Domain Generalization and Attention Mechanisms
by Nuanchen Lin, Wenfeng Zhao, Shenghao Liang and Minyue Zhong
Sensors 2023, 23(13), 6008; https://doi.org/10.3390/s23136008 - 28 Jun 2023
Cited by 7 | Viewed by 2767
Abstract
This paper presents a focused investigation into real-time segmentation in unstructured environments, a crucial aspect for enabling autonomous navigation in off-road robots. To address this challenge, an improved variant of the DDRNet23-slim model is proposed, which includes a lightweight network architecture and reclassifies [...] Read more.
This paper presents a focused investigation into real-time segmentation in unstructured environments, a crucial aspect for enabling autonomous navigation in off-road robots. To address this challenge, an improved variant of the DDRNet23-slim model is proposed, which includes a lightweight network architecture and reclassifies ten different categories, including drivable roads, trees, high vegetation, obstacles, and buildings, based on the RUGD dataset. The model’s design includes the integration of the semantic-aware normalization and semantic-aware whitening (SAN–SAW) module into the main network to improve generalization ability beyond the visible domain. The model’s segmentation accuracy is improved through the fusion of channel attention and spatial attention mechanisms in the low-resolution branch to enhance its ability to capture fine details in complex scenes. Additionally, to tackle the issue of category imbalance in unstructured scene datasets, a rare class sampling strategy (RCS) is employed to mitigate the negative impact of low segmentation accuracy for rare classes on the overall performance of the model. Experimental results demonstrate that the improved model achieves a significant 14% increase mIoU in the invisible domain, indicating its strong generalization ability. With a parameter count of only 5.79M, the model achieves mAcc of 85.21% and mIoU of 77.75%. The model has been successfully deployed on a a Jetson Xavier NX ROS robot and tested in both real and simulated orchard environments. Speed optimization using TensorRT increased the segmentation speed to 30.17 FPS. The proposed model strikes a desirable balance between inference speed and accuracy and has good domain migration ability, making it applicable in various domains such as forestry rescue and intelligent agricultural orchard harvesting. Full article
(This article belongs to the Special Issue Vision Sensors: Image Processing Technologies and Applications)
Show Figures

Figure 1

17 pages, 41360 KB  
Article
Traversable Region Detection and Tracking for a Sparse 3D Laser Scanner for Off-Road Environments Using Range Images
by Jhonghyun An
Sensors 2023, 23(13), 5898; https://doi.org/10.3390/s23135898 - 25 Jun 2023
Cited by 1 | Viewed by 2494
Abstract
This study proposes a method for detecting and tracking traversable regions in off-road conditions for unmanned ground vehicles (UGVs). Off-road conditions, such as rough terrain or fields, present significant challenges for UGV navigation, and detecting and tracking traversable regions is essential to ensure [...] Read more.
This study proposes a method for detecting and tracking traversable regions in off-road conditions for unmanned ground vehicles (UGVs). Off-road conditions, such as rough terrain or fields, present significant challenges for UGV navigation, and detecting and tracking traversable regions is essential to ensure safe and efficient operation. Using a 3D laser scanner and range-image-based approach, a method is proposed for detecting traversable regions under off-road conditions; this is followed by a Bayesian fusion algorithm for tracking the traversable regions in consecutive frames. Our range-image-based traversable-region-detection approach enables efficient processing of point cloud data from a 3D laser scanner, allowing the identification of traversable areas that are safe for the unmanned ground vehicle to drive on. The effectiveness of the proposed method was demonstrated using real-world data collected during UGV operations on rough terrain, highlighting its potential as a solution for improving UGV navigation capabilities in challenging environments. Full article
(This article belongs to the Special Issue Object Detection Based on Vision Sensors and Neural Network)
Show Figures

Figure 1

Back to TopTop