AboutDialog.cpp
Go to the documentation of this file.
00001 /*
00002 Copyright (c) 2010-2016, Mathieu Labbe - IntRoLab - Universite de Sherbrooke
00003 All rights reserved.
00004 
00005 Redistribution and use in source and binary forms, with or without
00006 modification, are permitted provided that the following conditions are met:
00007     * Redistributions of source code must retain the above copyright
00008       notice, this list of conditions and the following disclaimer.
00009     * Redistributions in binary form must reproduce the above copyright
00010       notice, this list of conditions and the following disclaimer in the
00011       documentation and/or other materials provided with the distribution.
00012     * Neither the name of the Universite de Sherbrooke nor the
00013       names of its contributors may be used to endorse or promote products
00014       derived from this software without specific prior written permission.
00015 
00016 THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND
00017 ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED
00018 WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE
00019 DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY
00020 DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES
00021 (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
00022 LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND
00023 ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT
00024 (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS
00025 SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
00026 */
00027 
00028 #include "rtabmap/gui/AboutDialog.h"
00029 #include "rtabmap/core/Parameters.h"
00030 #include "rtabmap/core/CameraRGBD.h"
00031 #include "rtabmap/core/CameraStereo.h"
00032 #include "rtabmap/core/Optimizer.h"
00033 #include "ui_aboutDialog.h"
00034 #include <opencv2/core/version.hpp>
00035 #include <pcl/pcl_config.h>
00036 #include <vtkVersion.h>
00037 
00038 namespace rtabmap {
00039 
00040 AboutDialog::AboutDialog(QWidget * parent) :
00041         QDialog(parent)
00042 {
00043         _ui = new Ui_aboutDialog();
00044         _ui->setupUi(this);
00045         QString version = Parameters::getVersion().c_str();
00046 #if DEMO_BUILD
00047         version.append(" [DEMO]");
00048 #endif
00049         QString cv_version = CV_VERSION;
00050 #ifdef RTABMAP_NONFREE
00051         cv_version.append(" [With nonfree]");
00052         _ui->label_opencv_license->setText("Not Commercial");
00053 #else
00054         cv_version.append(" [Without nonfree]");
00055         _ui->label_opencv_license->setText("BSD");
00056 #endif
00057         _ui->label_version->setText(version);
00058         _ui->label_opencv_version->setText(cv_version);
00059         _ui->label_pcl_version->setText(PCL_VERSION_PRETTY);
00060         _ui->label_vtk_version->setText(vtkVersion::GetVTKVersion());
00061         _ui->label_qt_version->setText(qVersion());
00062 #ifdef RTABMAP_OCTOMAP
00063         _ui->label_octomap->setText("Yes");
00064         _ui->label_octomap_license->setEnabled(true);
00065 #else
00066         _ui->label_octomap->setText("No");
00067         _ui->label_octomap_license->setEnabled(false);
00068 #endif
00069 #ifdef RTABMAP_CPUTSDF
00070         _ui->label_cputsdf->setText("Yes");
00071         _ui->label_cputsdf_license->setEnabled(true);
00072 #else
00073         _ui->label_cputsdf->setText("No");
00074         _ui->label_cputsdf_license->setEnabled(false);
00075 #endif
00076 #ifdef RTABMAP_OPENCHISEL
00077         _ui->label_openchisel->setText("Yes");
00078 #else
00079         _ui->label_openchisel->setText("No");
00080 #endif
00081 
00082         _ui->label_freenect->setText(CameraFreenect::available()?"Yes":"No");
00083         _ui->label_freenect_license->setEnabled(CameraFreenect::available());
00084         _ui->label_openni2->setText(CameraOpenNI2::available()?"Yes":"No");
00085         _ui->label_openni2_license->setEnabled(CameraOpenNI2::available());
00086         _ui->label_freenect2->setText(CameraFreenect2::available()?"Yes":"No");
00087         _ui->label_freenect2_license->setEnabled(CameraFreenect2::available());
00088         _ui->label_realsense->setText(CameraRealSense::available() ? "Yes" : "No");
00089         _ui->label_realsense_license->setEnabled(CameraRealSense::available());
00090         _ui->label_realsense2->setText(CameraRealSense2::available() ? "Yes" : "No");
00091         _ui->label_realsense2_license->setEnabled(CameraRealSense2::available());
00092         _ui->label_dc1394->setText(CameraStereoDC1394::available()?"Yes":"No");
00093         _ui->label_dc1394_license->setEnabled(CameraStereoDC1394::available());
00094         _ui->label_flycapture2->setText(CameraStereoFlyCapture2::available()?"Yes":"No");
00095         _ui->label_zed->setText(CameraStereoZed::available()?"Yes":"No");
00096 
00097         _ui->label_toro->setText(Optimizer::isAvailable(Optimizer::kTypeTORO)?"Yes":"No");
00098         _ui->label_toro_license->setEnabled(Optimizer::isAvailable(Optimizer::kTypeTORO)?true:false);
00099         _ui->label_g2o->setText(Optimizer::isAvailable(Optimizer::kTypeG2O)?"Yes":"No");
00100         _ui->label_g2o_license->setEnabled(Optimizer::isAvailable(Optimizer::kTypeG2O)?true:false);
00101         _ui->label_gtsam->setText(Optimizer::isAvailable(Optimizer::kTypeGTSAM)?"Yes":"No");
00102         _ui->label_gtsam_license->setEnabled(Optimizer::isAvailable(Optimizer::kTypeGTSAM)?true:false);
00103         _ui->label_cvsba->setText(Optimizer::isAvailable(Optimizer::kTypeCVSBA)?"Yes":"No");
00104         _ui->label_cvsba_license->setEnabled(Optimizer::isAvailable(Optimizer::kTypeCVSBA)?true:false);
00105 
00106 #ifdef RTABMAP_POINTMATCHER
00107         _ui->label_libpointmatcher->setText("Yes");
00108         _ui->label_libpointmatcher_license->setEnabled(true);
00109 #else
00110         _ui->label_libpointmatcher->setText("No");
00111         _ui->label_libpointmatcher_license->setEnabled(false);
00112 #endif
00113 
00114 #ifdef RTABMAP_FOVIS
00115         _ui->label_fovis->setText("Yes");
00116         _ui->label_fovis_license->setEnabled(true);
00117 #else
00118         _ui->label_fovis->setText("No");
00119         _ui->label_fovis_license->setEnabled(false);
00120 #endif
00121 #ifdef RTABMAP_VISO2
00122         _ui->label_viso2->setText("Yes");
00123         _ui->label_viso2_license->setEnabled(true);
00124 #else
00125         _ui->label_viso2->setText("No");
00126         _ui->label_viso2_license->setEnabled(false);
00127 #endif
00128 #ifdef RTABMAP_DVO
00129         _ui->label_dvo->setText("Yes");
00130         _ui->label_dvo_license->setEnabled(true);
00131 #else
00132         _ui->label_dvo->setText("No");
00133         _ui->label_dvo_license->setEnabled(false);
00134 #endif
00135 #ifdef RTABMAP_ORB_SLAM2
00136         _ui->label_orbslam2->setText("Yes");
00137         _ui->label_orbslam2_license->setEnabled(true);
00138 #else
00139         _ui->label_orbslam2->setText("No");
00140         _ui->label_orbslam2_license->setEnabled(false);
00141 #endif
00142 
00143 #ifdef RTABMAP_OKVIS
00144         _ui->label_okvis->setText("Yes");
00145         _ui->label_okvis_license->setEnabled(true);
00146 #else
00147         _ui->label_okvis->setText("No");
00148         _ui->label_okvis_license->setEnabled(false);
00149 #endif
00150 
00151 #ifdef RTABMAP_LOAM
00152         _ui->label_loam->setText("Yes");
00153         _ui->label_loam_license->setEnabled(true);
00154 #else
00155         _ui->label_loam->setText("No");
00156         _ui->label_loam_license->setEnabled(false);
00157 #endif
00158 
00159 #ifdef RTABMAP_MSCKF_VIO
00160         _ui->label_msckf->setText("Yes");
00161         _ui->label_msckf_license->setEnabled(true);
00162 #else
00163         _ui->label_msckf->setText("No");
00164         _ui->label_msckf_license->setEnabled(false);
00165 #endif
00166 
00167 }
00168 
00169 AboutDialog::~AboutDialog()
00170 {
00171         delete _ui;
00172 }
00173 
00174 }


rtabmap
Author(s): Mathieu Labbe
autogenerated on Thu Jun 6 2019 21:59:18