#include "rtabmap_viz/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_conversions/MsgConversion.h"
#include "rtabmap_msgs/GetMap.h"
#include "rtabmap_msgs/SetGoal.h"
#include "rtabmap_msgs/SetLabel.h"
#include "rtabmap_msgs/RemoveLabel.h"
#include "rtabmap_viz/PreferencesDialogROS.h"
Go to the source code of this file.
◆ max3()