occupancy-grid-map
There are 81 repositories under occupancy-grid-map topic.
NVlabs/VoxFormer
Official PyTorch implementation of VoxFormer [CVPR 2023 Highlight]
neka-nat/cupoch
Robotics with GPU computing
hasauino/rrt_exploration
A ROS package that implements a multi-robot RRT-based map exploration algorithm. It also has the image-based frontier detection that uses image processing to extract frontier points.
ethz-asl/wavemap
Fast, efficient and accurate multi-resolution, multi-sensor 3D occupancy mapping
winstxnhdw/AutoCarROS2
A virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS 2 and Gazebo.
TheCodez/dynamic-occupancy-grid-map
Implementation of "A Random Finite Set Approach for Dynamic Occupancy Grid Maps with Real-Time Application"
ai4ce/SSCBench
SSCBench: A Large-Scale 3D Semantic Scene Completion Benchmark for Autonomous Driving
ai4ce/Occ4cast
Occ4cast: LiDAR-based 4D Occupancy Completion and Forecasting
llmbev/talk2bev
Talk2BEV: Language-Enhanced Bird's Eye View Maps (ICRA'24)
RansML/Bayesian_Hilbert_Maps
Mapping spatiotemporal patterns in an online and continuous fashion
richardos/occupancy-grid-a-star
A Python implementation of the A* algorithm in a 2D Occupancy Grid Map
NVIDIA-ISAAC-ROS/isaac_ros_map_localization
NVIDIA-accelerated global localization
lukovicaleksa/grid-mapping-in-ROS
Creating Occupancy Grid Maps using Static State Bayes filter and Bresenham's algorithm for mobile robot (turtlebot3_burger) in ROS.
ika-rwth-aachen/EviLOG
TensorFlow training pipeline and dataset for prediction of evidential occupancy grid maps from lidar point clouds.
rFalque/voxelization_and_sdf
C++11 code for building a 3D occupancy grid an SDF 3D grid from a mesh
MukhlasAdib/KITTI_Mapping
Tutorial on Autonomous Vehicles' mapping algorithm with Occupancy Grid Map and Dynamic Grid Map using KITTI Dataset
MaxLing/particle_filter_SLAM
SLAM with occupancy grid and particle filter, using lidar, joints, IMU and odometry data from THOR humanoid robot
winstxnhdw/AutoCarROS
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
amirx96/velodyne_height_map_occupancy_map
ROS obstacle detection for 3D point clouds using a height map algorithm.
jacobhuesman/cloud_to_map
Algorithm that converts point cloud data into an occupancy grid
ksm26/OccupancyGrid-Predictions
Predicting Future Occupancy Grids in Dynamic Environment with Spatio-Temporal Learning
TempleRAIL/SOGMP
[CoRL 2023] SOGMP++/SOGMP: Stochastic Occupancy Grid Map Prediction in Dynamic Scenes
chrissunny94/t265_robot_navigation
Using a Intel Realsense T265 to build an occupancy grid and autonomously navigate around using move_base
SecureSheII/Self-Driving-Car-Projects
AV Projects with the CARLA simulator
debbynirwan/mapping_controller
Autonomous Occupancy Probability Mapping Mission Robot Code with Webots and ROS2.
reuben-thomas/fyp-moovita
Development of a virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS and Gazebo.
saeedghsh/Mesh-To-Occupancy-Map
Conversion from mesh (.ply files) to bitmap Occupancy map (.png file)
saptadeb/botLab
Project for ROB 550. Implementing SLAM using LIDAR, wheel encoders and IMU on MBot.
hiwad-aziz/ros2_occupancy_grid
A ROS2 package for occupancy grid mapping with known poses for laser scan data.
yuxiangdai/TellORB
Real-time visual Simultaneous Localization and Mapping using ORB-SLAM2 for a DJI Tello Drone
anindex/Processing-path_planning
Implement D*Lite and A* Algorithm on Processing environment
NekSfyris/occupancy_grid_mapping_2DLidar
Occupancy grid mapping based on 2D Lidar data assuming perfect knowledge of a robot's trajectory.
harrylal/simulation-of-birds-eye-view-map-generation-from-rgbd-data
Project: Generating overhead birds-eye-view occupancy grid map with semantic information from lidar and camera data.
csiro-robotics/ohm_assay
This repo is provided to assess the performance of OHM against several other voxel or octree based libraries.
Dung-Han-Lee/PACMAN-multi-agent-pursuit-in-an-unknown-enviroment
multi-agent moving target pursuit in an unknown 4-connected grid world with persistent coverage planning
Tinker-Twins/Occupancy_Grid_Map_From_Monocular_Camera_Frame
This repository hosts MATLAB script for generating occupancy grid map from a monocular camera frame.