-
Notifications
You must be signed in to change notification settings - Fork 11
Commit
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
- Loading branch information
0 parents
commit e580fe3
Showing
4,330 changed files
with
420,199 additions
and
0 deletions.
The diff you're trying to view is too large. We only load the first 3000 changed files.
There are no files selected for viewing
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,170 @@ | ||
cmake_minimum_required(VERSION 2.8.3) | ||
project(supersurfel_fusion) | ||
|
||
add_compile_options(--std=c++11) | ||
|
||
if(NOT CMAKE_BUILD_TYPE) | ||
set(CMAKE_BUILD_TYPE Release) | ||
endif() | ||
|
||
set(CMAKE_CXX_FLAGS "-Wall -Wextra") | ||
set(CMAKE_CXX_FLAGS_DEBUG "-g") | ||
set(CMAKE_CXX_FLAGS_RELEASE "-O3") | ||
|
||
find_package(catkin REQUIRED COMPONENTS | ||
roscpp | ||
cv_bridge | ||
image_transport | ||
geometry_msgs | ||
message_filters | ||
tf | ||
nav_msgs | ||
visualization_msgs | ||
pcl_ros | ||
tf_conversions | ||
dynamic_reconfigure | ||
) | ||
|
||
find_package(OpenMP) | ||
if (OPENMP_FOUND) | ||
set (CMAKE_C_FLAGS "${CMAKE_C_FLAGS} ${OpenMP_C_FLAGS}") | ||
set (CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} ${OpenMP_CXX_FLAGS}") | ||
set (CMAKE_EXE_LINKER_FLAGS "${CMAKE_EXE_LINKER_FLAGS} ${OpenMP_EXE_LINKER_FLAGS}") | ||
endif() | ||
|
||
find_package(OpenCV 3 REQUIRED) | ||
|
||
list(APPEND CMAKE_MODULE_PATH ${PROJECT_SOURCE_DIR}/cmake) | ||
|
||
find_package(CUDA REQUIRED) | ||
include("${PROJECT_SOURCE_DIR}/cmake/UseCUDA.cmake") | ||
list(APPEND CUDA_NVCC_FLAGS "--std=c++11 --expt-relaxed-constexpr") | ||
|
||
find_package(SuiteSparse REQUIRED) | ||
|
||
find_package(G2O REQUIRED) | ||
set(G2O_LIBRARIES ${G2O_CORE_LIBRARY} ${G2O_STUFF_LIBRARY} ${G2O_TYPES_SBA} ${G2O_TYPES_SLAM3D} ${G2O_SOLVER_PCG}) | ||
|
||
set(DARKNET_INCLUDE_DIR ${PROJECT_SOURCE_DIR}/third_party/darknet/include) | ||
set(DARKNET_LIBRARY ${PROJECT_SOURCE_DIR}/third_party/darknet/libdarknet.so) | ||
|
||
#generate_messages( | ||
# DEPENDENCIES | ||
# ) | ||
|
||
generate_dynamic_reconfigure_options( | ||
config/SupersurfelFusionRGBDBenchmark.cfg | ||
) | ||
|
||
catkin_package( | ||
CATKIN_DEPENDS message_runtime roscpp cv_bridge image_transport geometry_msgs message_filters tf nav_msgs visualization_msgs pcl_ros tf_conversions dynamic_reconfigure | ||
) | ||
|
||
include_directories( | ||
${PROJECT_SOURCE_DIR}/core/include/ | ||
${PROJECT_SOURCE_DIR}/node/ | ||
${PROJECT_SOURCE_DIR}/third_party/eigen3/ | ||
#${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/include/ | ||
${PROJECT_SOURCE_DIR}/third_party/ORB/ | ||
${PROJECT_SOURCE_DIR}/third_party/GMS/ | ||
${PROJECT_SOURCE_DIR}/third_party/DefGraph_utils/include/ | ||
${catkin_INCLUDE_DIRS} | ||
${OpenCV_INCLUDE_DIRS} | ||
${SUITESPARSE_INCLUDE_DIRS} | ||
${DARKNET_INCLUDE_DIR} | ||
) | ||
|
||
cuda_include_directories( | ||
${PROJECT_SOURCE_DIR}/core/include/ | ||
${PROJECT_SOURCE_DIR}/third_party/eigen3/ | ||
#${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/include/ | ||
${PROJECT_SOURCE_DIR}/third_party/DefGraph_utils/include/ | ||
${catkin_INCLUDE_DIRS} | ||
${OpenCV_INCLUDE_DIRS} | ||
${DARKNET_INCLUDE_DIR} | ||
) | ||
|
||
#cuda_add_library(orb_cuda | ||
# ${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/src/ORBextractor.cc | ||
# ${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/src/cuda/Allocator_gpu.cu | ||
# ${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/src/cuda/Fast_gpu.cu | ||
# ${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/src/cuda/Orb_gpu.cu | ||
# ${PROJECT_SOURCE_DIR}/third_party/ORB_CUDA/src/cuda/Cuda.cu | ||
#) | ||
#target_link_libraries(orb_cuda | ||
# ${OpenCV_LIBS} | ||
#) | ||
add_library(orb | ||
${PROJECT_SOURCE_DIR}/third_party/ORB/ORBextractor.cpp | ||
) | ||
target_link_libraries(orb | ||
${OpenCV_LIBS} | ||
) | ||
|
||
add_library(gms | ||
${PROJECT_SOURCE_DIR}/third_party/GMS/gms_matcher.cpp | ||
) | ||
target_link_libraries(gms | ||
${OpenCV_LIBS} | ||
) | ||
|
||
add_library(sparse_vo | ||
core/src/sparse_vo.cpp | ||
core/src/local_map.cpp | ||
core/src/pnp_solver.cpp | ||
) | ||
target_link_libraries(sparse_vo | ||
#orb_cuda | ||
orb | ||
gms | ||
${OpenCV_LIBS} | ||
${G2O_LIBRARIES} | ||
) | ||
|
||
add_library(cholesky_decomp | ||
${PROJECT_SOURCE_DIR}/third_party/DefGraph_utils/src/CholeskyDecomp.cpp | ||
) | ||
target_link_libraries(cholesky_decomp | ||
${SUITESPARSE_LIBRARIES} | ||
) | ||
|
||
cuda_add_library(sfusion | ||
core/src/supersurfel_fusion.cu | ||
core/src/TPS_RGBD.cu | ||
core/src/TPS_RGBD_kernels.cu | ||
core/src/supersurfel_fusion_kernels.cu | ||
core/src/dense_registration.cu | ||
core/src/dense_registration_kernels.cu | ||
core/src/cached_allocator.cpp | ||
core/src/ferns.cu | ||
core/src/ferns_kernels.cu | ||
core/src/deformation_graph.cu | ||
core/src/deformation_graph_kernels.cu | ||
core/src/motion_detection.cu | ||
core/src/motion_detection_kernels.cu | ||
) | ||
target_link_libraries(sfusion | ||
${OpenCV_LIBS} | ||
${catkin_LIBRARIES} | ||
sparse_vo | ||
gms | ||
cholesky_decomp | ||
${DARKNET_LIBRARY} | ||
) | ||
|
||
add_executable(supersurfel_fusion_node | ||
node/main.cpp | ||
node/supersurfel_fusion_node.cpp | ||
) | ||
target_link_libraries(supersurfel_fusion_node | ||
sfusion | ||
) | ||
|
||
add_executable(supersurfel_fusion_rgbd_benchmark_node | ||
node/main_rgbd_benchmark.cpp | ||
node/supersurfel_fusion_rgbd_benchmark_node.cpp | ||
) | ||
target_link_libraries(supersurfel_fusion_rgbd_benchmark_node | ||
sfusion | ||
) | ||
add_dependencies(supersurfel_fusion_rgbd_benchmark_node ${PROJECT_NAME}_gencfg) |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,162 @@ | ||
# SupersurfelFusion # | ||
|
||
Dense RGB-D SLAM system RGB-D SLAM articulated around a supersurfel-based 3D | ||
representation for fast, lightweight and compact mapping in indoor environment. | ||
|
||
Check out the video: | ||
|
||
[data:image/s3,"s3://crabby-images/f12b2/f12b291b1df0823b2e3f87649a51683943d05f72" alt="SupersurfelFusion video"](https://www.youtube.com/watch?v=hzzVVHUAO74 "SupersurfelFusion video") | ||
|
||
## Related Publications ## | ||
|
||
Please cite this publication when using SupersurfelFusion: +TODO | ||
|
||
Note that the software is experimental and some changes have been done since the publication of the paper. For instance in the part performing moving object detection and removal, we add the possibility to use a lightweight deep learning based object detection to extract humans and improve the robustness against dynamic elements. | ||
|
||
## Requirements ## | ||
|
||
- ### Ubuntu 16.04 or 18.04 ### | ||
The system has been tested both on Ubuntu 16.04 and 18.04. | ||
|
||
- ### [ROS](https://www.ros.org/) Kinetic or Melodic ### | ||
Use ROS Kinetic on Ubuntu 16.04 and Melodic on 18.04. | ||
|
||
- ### [CUDA](https://developer.nvidia.com/cuda-downloads) >= 9.0 ### | ||
The system has been tested on platforms with CUDA 9.0 and CUDA 10.2. | ||
|
||
- ### [OpenCV](https://opencv.org/) 3.4 ### | ||
We use OpenCV 3.4 but any version of OpenCV 3 should work. OpenCV has to be installed with CUDA support and with contrib modules. | ||
Note that, to be able to use with ROS a version of OpenCV different from the default ROS OpenCV version (which doesn't have CUDA support), you might have to rebuild all ROS packages that require OpenCV against your specific version, particularly the [vision_opencv](http://wiki.ros.org/vision_opencv) package that provides [cv_bridge](http://wiki.ros.org/cv_bridge). If you have differents OpenCV versions installed on your computer, you can specify the one you want to use at build time by calling `catkin_make` like this: | ||
``` | ||
$ catkin_make -DOpenCV_DIR=<your OpenCV path> | ||
``` | ||
or by using this: | ||
``` | ||
find_package(OpenCV REQUIRED | ||
NO_MODULE #Should be optional, tells CMake to use config mode | ||
PATHS <your OpenCV path># Tells CMake to look here | ||
NO_DEFAULT_PATH #and don't look anywhere else) | ||
``` | ||
inside your CMakeLists.txt instead of: | ||
``` | ||
find_package(OpenCV 3 REQUIRED) | ||
``` | ||
to be sure to link against the desired version. | ||
|
||
- ### [SuiteSparse](http://faculty.cse.tamu.edu/davis/suitesparse.html) ### | ||
This dependency can be resolved by installing the following package: libsuitesparse-dev. | ||
|
||
- ### [G2O](https://github.com/RainerKuemmerle/g2o) ### | ||
|
||
## Third Parties ## | ||
|
||
Our implementation integrates parts of codes from external libraries. | ||
|
||
### [ORB-SLAM2](https://github.com/raulmur/ORB-SLAM2) ### | ||
For features extraction and associated descriptors computation. | ||
|
||
### [GMS-Feature-Matcher](https://github.com/JiawangBian/GMS-Feature-Matcher) ### | ||
We use Grid-based Motion Statistics for robust feature correspondence. | ||
|
||
### [ElasticFusion](https://github.com/mp3guy/ElasticFusion) ### | ||
We credit ElasticFusion as a significant basis for our deformation graph and loop closure implementation. | ||
|
||
### [Lightweight Visual Tracking (LVT)](https://github.com/SAR-Research-Lab/lvt) ### | ||
We based the design of our feature-based visual odometry on their method and our Perspective-n-Point solver has been implemented following their code. | ||
|
||
### [YOLOv4](https://github.com/AlexeyAB/darknet) ### | ||
We integrated tiny YOLOv4 in our pipeline for improving robustness in dynamic scenes by detecting persons. To see how to enable or disable its use please refer | ||
to [this section](### Node ###). | ||
|
||
## Licenses ## | ||
SupersurfelFusion is released under a GPLv3 license (see `supersurfel_fusion/licenses/LICENSE-SupersurfelFusion.txt`). | ||
|
||
SupersurfelFusion includes differents third-party open-source software, which themselves include third-party open-source software. Each of these components have their own license. | ||
|
||
You can find the licenses in the repository `supersurfel_fusion/licenses/`. | ||
|
||
## Build SupersurfelFusion ## | ||
|
||
The system is provided as a ROS package which can be copied or cloned into your workspace and built directly using catkin. | ||
|
||
### 1. Clone the repository ### | ||
|
||
``` | ||
$ cd ~/catkin_ws/src | ||
$ git clone https://gricad-gitlab.univ-grenoble-alpes.fr/canovasb/supersurfel_fusion.git | ||
``` | ||
|
||
### 2. Build ### | ||
First install darknet to use the YOLOv4 object detector using `make` in the darknet repository (`supersurfel_fusion/third_party/darknet`). | ||
In the `Makefile` set: | ||
|
||
- `GPU=1` to build enabling CUDA support (OPTIONAL) | ||
- `OPENCV=1` to build with OpenCV | ||
- `LIBSO=1` to build the library `darknet.so` | ||
|
||
Once darknet installed just go to your catkin workspace root directory and build using `catkin_make`. | ||
|
||
``` | ||
$ cd ~/catkin_ws | ||
$ catkin_make | ||
``` | ||
|
||
## Usage ## | ||
|
||
Our system takes as input **registered** RGB-D frames. It is interfaced with a ROS node. | ||
|
||
### Run with Intel Realsense ### | ||
|
||
We provide a lauch file to start our system along an Intel RealSense cameras (D400 series SR300 camera and T265 Tracking Module) and an Rviz GUI. ROS drivers for Intel Realsense Devices can be found [here](https://github.com/IntelRealSense/realsense-ros). To use SupersurfelFusion, open a terminal and execute: | ||
``` | ||
$ roslaunch supersurfel_fusion supersurfel_fusion_realsense_rviz.launch | ||
``` | ||
|
||
### Run with rosbag or other RGB-D sensors ### | ||
|
||
To use SupersurfelFusion with other devices you just need to remap the `/camera_info`, `/image_color` and `/image_depth` topics in the supersurfel_fusion_rviz.launch to the topics published by your sensor or bagfile. Then start your device on ROS with registered RGB-D stream, or play your rosbag and execute: | ||
``` | ||
$ roslaunch supersurfel_fusion supersurfel_fusion_rviz.launch | ||
``` | ||
|
||
### Run without RViz GUI ### | ||
|
||
``` | ||
$ roslaunch supersurfel_fusion supersurfel_fusion_realsense.launch | ||
``` | ||
or | ||
``` | ||
$ roslaunch supersurfel_fusion supersurfel_fusion.launch | ||
``` | ||
|
||
### Run with [TUM RGB-D Dataset](https://vision.in.tum.de/data/datasets/rgbd-dataset) sequences ### | ||
|
||
``` | ||
$ roslaunch supersurfel_fusion supersurfel_fusion_rgbd_benchmark.launch | ||
``` | ||
We provide two sequences in `supersurfel_fusion/rgbd_benchmark` that can be specified in the `supersurfel_fusion_rgbd_benchmark.launch` launch file. When using this launch file, SupersurfelFusion processes every frame and can be played/paused anytime by checking the "stop" boxe of the rqt_reconfigure window that popped up. Estimated and ground truth trajectories are displayed in Rviz and the estimation is saved (location can be specified in the launch file) so it can be used for evaluation with [tools](https://vision.in.tum.de/data/datasets/rgbd-dataset/tools#evaluation) provided by the TUM. | ||
|
||
### Node ### | ||
|
||
The `supersurfel_fusion_node`, executed by the differents launchfile, is the node that allows to run SupersurfelFusion under ROS. | ||
There are differents parameters you can play with in the different launch files. For instance you can enable/disable the loop closure, enable/disable the moving object detection with or without YOLO... | ||
|
||
#### Subscribed topics: #### | ||
|
||
- `\image_color` | ||
- `\image_depth` | ||
- `\camera_info` | ||
|
||
#### Published topics: #### | ||
|
||
- `\superpixels`: image of superpixels | ||
- `\slanted_plane`: image of slanted plane associated to superpixels | ||
- `\mod_mask`: binary mask of detected moving elements | ||
- `\model_supersurfel_marker`: global map | ||
- `\frame_supersurfel_marker`: frame supersurfels | ||
- `\nodes_marker`: nodes of the deformation graph | ||
- `\edges_marker`: edges of the deformation graph | ||
- `\constraints_marker`: deformation constraints | ||
- `\trajectory`: camera path | ||
- `\vo`: camera odometry | ||
- `\local_map`: sparse vo local map point cloud |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,35 @@ | ||
############################# | ||
#Sourced from: | ||
#https://raw.githubusercontent.com/jwetzl/CudaLBFGS/master/CheckComputeCapability.cmake | ||
############################# | ||
# Check for GPUs present and their compute capability | ||
# based on http://stackoverflow.com/questions/2285185/easiest-way-to-test-for-existence-of-cuda-capable-gpu-from-cmake/2297877#2297877 (Christopher Bruns) | ||
|
||
if(CUDA_FOUND) | ||
message(STATUS "${CMAKE_MODULE_PATH}/cuda_compute_capability.cpp") | ||
try_run(RUN_RESULT_VAR COMPILE_RESULT_VAR | ||
${CMAKE_BINARY_DIR} | ||
${CMAKE_MODULE_PATH}/cuda_compute_capability.cpp | ||
CMAKE_FLAGS | ||
-DINCLUDE_DIRECTORIES:STRING=${CUDA_TOOLKIT_INCLUDE} | ||
-DLINK_LIBRARIES:STRING=${CUDA_CUDART_LIBRARY} | ||
COMPILE_OUTPUT_VARIABLE COMPILE_OUTPUT_VAR | ||
RUN_OUTPUT_VARIABLE RUN_OUTPUT_VAR) | ||
message(STATUS "Compile: ${RUN_OUTPUT_VAR}") | ||
if (COMPILE_RESULT_VAR) | ||
message(STATUS "compiled -> " ${RUN_RESULT_VAR}) | ||
else() | ||
message(STATUS "didn't compile") | ||
endif() | ||
# COMPILE_RESULT_VAR is TRUE when compile succeeds | ||
# RUN_RESULT_VAR is zero when a GPU is found | ||
if(COMPILE_RESULT_VAR AND NOT RUN_RESULT_VAR) | ||
message(STATUS "worked") | ||
set(CUDA_HAVE_GPU TRUE CACHE BOOL "Whether a CUDA-capable GPU is present") | ||
set(CUDA_COMPUTE_CAPABILITY ${RUN_OUTPUT_VAR} CACHE STRING "Compute capabilities of CUDA-capable GPUs present (separated by semicolons)") | ||
mark_as_advanced(CUDA_COMPUTE_CAPABILITY) | ||
else() | ||
message(STATUS "didn't work") | ||
set(CUDA_HAVE_GPU FALSE CACHE BOOL "Whether a CUDA-capable GPU is present") | ||
endif() | ||
endif() |
Oops, something went wrong.