#include "rtabmap_ros/GuiWrapper.h"
#include <QApplication>
#include <QDir>
#include <std_srvs/Empty.h>
#include <std_msgs/Empty.h>
#include <std_msgs/Int32MultiArray.h>
#include <rtabmap/utilite/UEventsManager.h>
#include <rtabmap/utilite/UConversion.h>
#include <rtabmap/utilite/UDirectory.h>
#include <opencv2/highgui/highgui.hpp>
#include <rtabmap/gui/MainWindow.h>
#include <rtabmap/core/RtabmapEvent.h>
#include <rtabmap/core/Parameters.h>
#include <rtabmap/core/ParamEvent.h>
#include <rtabmap/core/OdometryEvent.h>
#include <rtabmap/core/util2d.h>
#include <rtabmap/core/util3d.h>
#include <rtabmap/core/util3d_transforms.h>
#include <rtabmap/utilite/UTimer.h>
#include "rtabmap_ros/MsgConversion.h"
#include "rtabmap_ros/GetMap.h"
#include "rtabmap_ros/SetGoal.h"
#include "rtabmap_ros/SetLabel.h"
#include "rtabmap_ros/RemoveLabel.h"
#include "rtabmap_ros/PreferencesDialogROS.h"
Go to the source code of this file.
|  | 
| float | max3 (const float &a, const float &b, const float &c) | 
|  | 
◆ max3()
      
        
          | float max3 | ( | const float & | a, | 
        
          |  |  | const float & | b, | 
        
          |  |  | const float & | c | 
        
          |  | ) |  |  |