All Projects → briannemsick → radmap_point_clouds

briannemsick / radmap_point_clouds

Licence: other
Preprocessing, coordinate frame calibration, configuration files, and launching procedure used to generate point clouds with Google Cartographer for the RadMAP acquisition system. The RadMAP acquisition system consists of two LIDARS, differential GPS, two Ladybug 360 cameras, and an IMU.

Programming Languages

python
139335 projects - #7 most used programming language
lua
6591 projects
C++
36643 projects - #6 most used programming language
CMake
9771 projects

Projects that are alternatives of or similar to radmap point clouds

Lego Loam
LeGO-LOAM: Lightweight and Ground-Optimized Lidar Odometry and Mapping on Variable Terrain
Stars: ✭ 1,138 (+4276.92%)
Mutual labels:  imu, lidar
lidar-sync-mimics-gps
Open-Source LiDAR Time Synchronization System by Mimicking GPS-clock
Stars: ✭ 52 (+100%)
Mutual labels:  imu, lidar
Staticmapping
Use LiDAR to map the static world
Stars: ✭ 191 (+634.62%)
Mutual labels:  imu, lidar
Urbannavdataset
UrbanNav: an Open-Sourcing Localization Data Collected in Asian Urban Canyons, Including Tokyo and Hong Kong
Stars: ✭ 79 (+203.85%)
Mutual labels:  imu, lidar
Displaz.jl
Julia bindings for the displaz lidar viewer
Stars: ✭ 16 (-38.46%)
Mutual labels:  lidar
Tinfour
Delaunay and Constrained Delaunay Triangulations in Java, providing high-performance utilities for modeling surfaces with support for Lidar LAS files, Digital Elevation Models (DEM), finite element analysis, path planning, natural neighbor interpolation, and other applications of Triangulated Irregular Networks (TIN)
Stars: ✭ 119 (+357.69%)
Mutual labels:  lidar
Map Based Visual Localization
A general framework for map-based visual localization. It contains 1) Map Generation which support traditional features or deeplearning features. 2) Hierarchical-Localizationvisual in visual(points or line) map. 3)Fusion framework with IMU, wheel odom and GPS sensors.
Stars: ✭ 229 (+780.77%)
Mutual labels:  imu
Kimera Vio Ros
ROS wrapper for Kimera-VIO
Stars: ✭ 182 (+600%)
Mutual labels:  imu
ZeroSimROSUnity
Robotic simulation in Unity with ROS integration.
Stars: ✭ 112 (+330.77%)
Mutual labels:  lidar
hoverboard-sideboard-hack-GD
Hoverboard sideboard hack for GD32 boards
Stars: ✭ 68 (+161.54%)
Mutual labels:  imu
LiDARTag
This is a package for LiDARTag, described in paper: LiDARTag: A Real-Time Fiducial Tag System for Point Clouds
Stars: ✭ 161 (+519.23%)
Mutual labels:  lidar
ACSC
Automatic Calibration for Non-repetitive Scanning Solid-State LiDAR and Camera Systems
Stars: ✭ 210 (+707.69%)
Mutual labels:  lidar
PointCloudSegmentation
The research project based on Semantic KITTTI dataset, 3d Point Cloud Segmentation , Obstacle Detection
Stars: ✭ 62 (+138.46%)
Mutual labels:  lidar
Smartimu
Inertial Sensor Development Kit,STM32F411C、NRF52810、MPU9250、LPS22HB
Stars: ✭ 231 (+788.46%)
Mutual labels:  imu
lodToolkit
level-of-details toolkit(LTK). Convert osgb lod tree to 3mx tree. Convert pointcloud in ply/las/laz/xyz to 3mx/osgb tree.
Stars: ✭ 81 (+211.54%)
Mutual labels:  lidar
ExampleOfiOSLiDAR
Example Of iOS ARKit LiDAR
Stars: ✭ 373 (+1334.62%)
Mutual labels:  lidar
DeepLIO
Deep Lidar Inertial Odometry
Stars: ✭ 46 (+76.92%)
Mutual labels:  imu
SLAM-application
LeGO-LOAM, LIO-SAM, LVI-SAM, FAST-LIO2, Faster-LIO, VoxelMap, R3LIVE application and comparison on Gazebo and real-world datasets. Installation and config files are provided.
Stars: ✭ 258 (+892.31%)
Mutual labels:  lidar
OpenMaterial
3D model exchange format with physical material properties for virtual development, test and validation of automated driving.
Stars: ✭ 23 (-11.54%)
Mutual labels:  lidar
DSP-SLAM
[3DV 2021] DSP-SLAM: Object Oriented SLAM with Deep Shape Priors
Stars: ✭ 377 (+1350%)
Mutual labels:  lidar

Alt text

The radmap_point_clouds packages does the following:

  1. converts velodyne_msgs/VelodyneScan --> sensor_msgs/PointCloud2

  2. merges {sensor_msgs/PointCloud2,sensor_msgs/Imu,sensor_msgs/NavSatFix}

  3. Aligns 2 velodynes in SE3 (rotation and translation)

  4. Provides {.lua,.launch,.urdf} configuration files for cartographer

Notes:

  1. See installation.txt for step by step guide to build this package

  2. The bagfile names are assumed to be {port,starboard,imu}.bag with the appropriate topic names {/novatel_fix,/novatel_imu,/velodyne_packets_port, /velodyne_packets_starboard}

Requirements:

  1. https://github.com/ros-drivers/velodyne

  2. https://github.com/googlecartographer/cartographer_ros

  3. http://www.cloudcompare.org/release/

Recommendations (add to .bashrc):

  1. source /home/[user]/radmap/internal/devel/setup.bash

  2. export RADMAP="/home/[user]/radmap/internal/src/radmap_point_clouds"

  3. export RADBAGS="/home/[user]/radmap/internal/src/radmap_point_clouds/bagfiles"

Merging the bags

  1. Place port.bag, starboard.bag, imu.bag into [folder]
  2. cd [folder]
  3. roslaunch radmap_point_clouds lasers.launch
  4. rosrun radmap_point_clouds lasers
  5. python $RADMAP/src/bag_merging/bag_merge_radmap.py

Run cartographer

  1. copy params/radmap_config to cartographer/[dev branch]/share/cartographer_ros/radmap_config
  2. roslaunch cartographer_ros demo_radmap.launch bag_filename:=${RADBAGS}/[bagfile]
  3. rosservice call /finish_trajectory [name]
  4. roslaunch cartographer_ros assets_writer_radmap.launch bag_filenames:=${RADBAGS}/[bagfile] trajectory_filename:=/home/[user]/.ros/[name].pb
  5. cd /home/[user]/ --> CloudCompare --> visualize points.ply

(Optional) Vizualize aligned scans

  1. roslaunch radmap_point_clouds calibrated_tf.launch
  2. rosbag play [bagfile]
  3. rviz -d $RADMAP/.rviz/aligned_scans.rviz

Alt text Alt text

(Optional) Coordinate frame calibration

  1. velodyne_calib.m
  2. fill in calibrated_tf.launch
  3. roslaunch radmap_point_clouds calibrated_tf.launch
  4. rosrun tf tf_echo imu_link velodyne_port --> radmap.lau - velodyne_port_joint - origin
  5. rosrun tf tf_echo imu_link velodyne_starboard --> radmap.lau - velodyne_starboard_joint - origin
Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].