Go to the documentation of this file.
24 void(*progressCallback)(
void*,
int,
int),
25 void(*initCallback)(
void *,
int,
const char*),
26 void(*statsUpdatedCallback)(
void *,
29 int,
int,
int,
int,
int ,
int,
34 float,
float,
float,
float,
36 float,
float,
float,
float,
float,
float))
72 int openDatabaseNative(
const void *
object,
const char * databasePath,
bool databaseInMemory,
bool optimize,
bool clearDatabase)
85 void saveNative(
const void *
object,
const char * databasePath)
97 bool recoverNative(
const void *
object,
const char * from,
const char * to)
105 UERROR(
"object is null!");
118 UERROR(
"object is null!");
130 UERROR(
"object is null!");
137 float cloudVoxelSize,
138 bool regenerateCloud,
144 float optimizedVoxelSize,
146 int optimizedMaxPolygons,
147 float optimizedColorRadius,
148 bool optimizedCleanWhitePolygons,
149 int optimizedMinClusterSize,
150 float optimizedMaxTextureDistance,
151 int optimizedMinTextureClusterSize,
156 return native(
object)->
exportMesh(cloudVoxelSize, regenerateCloud, meshing, textureSize, textureCount, normalK, optimized, optimizedVoxelSize, optimizedDepth, optimizedMaxPolygons, optimizedColorRadius, optimizedCleanWhitePolygons, optimizedMinClusterSize, optimizedMaxTextureDistance, optimizedMinTextureClusterSize, blockRendering);
160 UERROR(
"object is null!");
173 UERROR(
"object is null!");
186 UERROR(
"object is null!");
198 UERROR(
"object is null!");
209 UERROR(
"object is null!");
213 void onTouchEventNative(
const void *
object,
int touch_count,
int event,
float x0,
float y0,
float x1,
224 UERROR(
"object is null!");
236 UERROR(
"object is null!");
247 UERROR(
"object is null!");
259 UERROR(
"object is null!");
271 UERROR(
"object is null!");
282 UERROR(
"object is null!");
287 float x,
float y,
float z,
float qx,
float qy,
float qz,
float qw,
double stamp)
295 UERROR(
"object is null!");
301 float x,
float y,
float z,
float qx,
float qy,
float qz,
float qw,
302 float fx,
float fy,
float cx,
float cy,
304 const void * yPlane,
const void * uPlane,
const void * vPlane,
int yPlaneLen,
int rgbWidth,
int rgbHeight,
int rgbFormat,
305 const void * depth,
int depthLen,
int depthWidth,
int depthHeight,
int depthFormat,
306 const void *
conf,
int confLen,
int confWidth,
int confHeight,
int confFormat,
307 const void * points,
int pointsLen,
int pointsChannels,
308 float vx,
float vy,
float vz,
float vqx,
float vqy,
float vqz,
float vqw,
309 float p00,
float p11,
float p02,
float p12,
float p22,
float p32,
float p23,
310 float t0,
float t1,
float t2,
float t3,
float t4,
float t5,
float t6,
float t7)
319 yPlane, uPlane, vPlane, yPlaneLen, rgbWidth, rgbHeight, rgbFormat,
320 depth, depthLen, depthWidth, depthHeight, depthFormat,
321 conf, confLen, confWidth, confHeight, confFormat,
322 (
const float *)points, pointsLen, pointsChannels,
324 p00, p11, p02, p12,
p22, p32, p23,
325 t0, t1, t2, t3, t4, t5, t6, t7);
329 UERROR(
"object is null!");
337 imageNative.
data = 0;
347 cv::Mat * imagePtr =
new cv::Mat();
349 cv::cvtColor(image, *imagePtr, cv::COLOR_BGR2BGRA);
350 std::vector<cv::Mat> channels;
351 cv::split(*imagePtr, channels);
352 channels.back() = cv::Scalar(255);
353 cv::merge(channels, *imagePtr);
355 imageNative.
data = imagePtr->data;
356 imageNative.
width = imagePtr->cols;
357 imageNative.
height = imagePtr->rows;
358 imageNative.
channels = imagePtr->channels();
378 UERROR(
"object is null!");
385 UERROR(
"object is null!");
392 UERROR(
"object is null!");
399 UERROR(
"object is null!");
406 UERROR(
"object is null!");
413 UERROR(
"object is null!");
420 UERROR(
"object is null!");
427 UERROR(
"object is null!");
434 UERROR(
"object is null!");
441 UERROR(
"object is null!");
448 UERROR(
"object is null!");
455 UERROR(
"object is null!");
462 UERROR(
"object is null!");
469 UERROR(
"object is null!");
476 UERROR(
"object is null!");
483 UERROR(
"object is null!");
490 UERROR(
"object is null!");
497 UERROR(
"object is null!");
504 UERROR(
"object is null!");
511 UERROR(
"object is null!");
518 UERROR(
"object is null!");
525 UERROR(
"object is null!");
532 UERROR(
"object is null!");
539 UERROR(
"object is null!");
546 UERROR(
"object is null!");
553 UERROR(
"object is null!");
560 UERROR(
"object is null!");
567 UERROR(
"object is null!");
574 UERROR(
"object is null!");
581 UERROR(
"object is null!");
588 UERROR(
"object is null!");
595 UERROR(
"object is null!");
599 void setGPSNative(
const void *
object,
double stamp,
double longitude,
double latitude,
double altitude,
double accuracy,
double bearing)
601 rtabmap::GPS gps(stamp, longitude, latitude, altitude, accuracy, bearing);
605 UERROR(
"object is null!");
613 UERROR(
"object is null!");
void setNodesFilteringNative(const void *object, bool enabled)
void setMinCloudDepth(float value)
void setMeshAngleToleranceNative(const void *object, float value)
bool recover(const std::string &from, const std::string &to)
void setClusterRatioNative(const void *object, float value)
void postOdometryEventNative(const void *object, float x, float y, float z, float qx, float qy, float qz, float qw, float fx, float fy, float cx, float cy, double stamp, const void *yPlane, const void *uPlane, const void *vPlane, int yPlaneLen, int rgbWidth, int rgbHeight, int rgbFormat, const void *depth, int depthLen, int depthWidth, int depthHeight, int depthFormat, const void *conf, int confLen, int confWidth, int confHeight, int confFormat, const void *points, int pointsLen, int pointsChannels, float vx, float vy, float vz, float vqx, float vqy, float vqz, float vqw, float p00, float p11, float p02, float p12, float p22, float p32, float p23, float t0, float t1, float t2, float t3, float t4, float t5, float t6, float t7)
void setSmoothing(bool enabled)
void setGridRotation(float value)
void setFullResolution(bool enabled)
void setupGraphicNative(const void *object, int width, int height)
void setAppendMode(bool enabled)
void setGraphOptimization(bool enabled)
void setBackfaceCullingNative(const void *object, bool enabled)
void setOnlineBlending(bool enabled)
void setScreenRotation(int displayRotation, int cameraRotation)
bool openConnection(const std::string &url, bool overwritten=false)
void SetCameraType(tango_gl::GestureCamera::CameraType camera_type)
void setMeshDecimationFactorNative(const void *object, float value)
int setMappingParameterNative(const void *object, const char *key, const char *value)
void setMaxCloudDepthNative(const void *object, float value)
void setMeshTriangleSizeNative(const void *object, int value)
void onTouchEventNative(const void *object, int touch_count, int event, float x0, float y0, float x1, float y1)
void setLocalizationMode(bool enabled)
void setOdomCloudShownNative(const void *object, bool shown)
void setOnlineBlendingNative(const void *object, bool enabled)
void setWireframe(bool enabled)
void postCameraPoseEventNative(const void *object, float x, float y, float z, float qx, float qy, float qz, float qw, double stamp)
void setMeshTriangleSize(int value)
void SetViewPort(int width, int height)
void setMeshRenderingNative(const void *object, bool enabled, bool withTexture)
void saveNative(const void *object, const char *databasePath)
ImageNative getPreviewImageNative(const char *databasePath)
void setMaxCloudDepth(float value)
void setGraphVisible(bool visible)
void releasePreviewImageNative(ImageNative image)
int postProcessing(int approach)
void setGraphOptimizationNative(const void *object, bool enabled)
RTABMapApp * native(const void *object)
void setRenderingTextureDecimationNative(const void *object, int value)
void setGridVisibleNative(const void *object, bool visible)
void setRenderingTextureDecimation(int value)
void destroyNativeApplication(const void *object)
void setPointSize(float value)
void setGridVisible(bool visible)
void setDepthConfidenceNative(const void *object, int value)
bool writeExportedMeshNative(const void *object, const char *directory, const char *name)
gtsam.ISAM2 optimize(List[GpsMeasurement] gps_measurements, List[ImuMeasurement] imu_measurements, gtsam.noiseModel.Diagonal sigma_init_x, gtsam.noiseModel.Diagonal sigma_init_v, gtsam.noiseModel.Diagonal sigma_init_b, gtsam.noiseModel.Diagonal noise_model_gps, KittiCalibration kitti_calibration, int first_gps_pose, int gps_skip)
void setCloudDensityLevel(int value)
void setMapCloudShownNative(const void *object, bool shown)
void OnTouchEvent(int touch_count, tango_gl::GestureCamera::TouchEvent event, float x0, float y0, float x1, float y1)
int openDatabaseNative(const void *object, const char *databasePath, bool databaseInMemory, bool optimize, bool clearDatabase)
void setAppendModeNative(const void *object, bool enabled)
StridedVectorType vy(make_vector(y, *n, std::abs(*incy)))
void setFOVNative(const void *object, float angle)
void setMeshAngleTolerance(float value)
cv::Mat loadPreviewImage() const
const void * createNativeApplication()
void setBackfaceCulling(bool enabled)
void setMaxGainRadius(float value)
void postOdometryEvent(rtabmap::Transform pose, float rgb_fx, float rgb_fy, float rgb_cx, float rgb_cy, float depth_fx, float depth_fy, float depth_cx, float depth_cy, const rtabmap::Transform &rgbFrame, const rtabmap::Transform &depthFrame, double stamp, double depthStamp, const void *yPlane, const void *uPlane, const void *vPlane, int yPlaneLen, int rgbWidth, int rgbHeight, int rgbFormat, const void *depth, int depthLen, int depthWidth, int depthHeight, int depthFormat, const void *conf, int confLen, int confWidth, int confHeight, int confFormat, const float *points, int pointsLen, int pointsChannels, const rtabmap::Transform &viewMatrix, float p00, float p11, float p02, float p12, float p22, float p32, float p23, float t0, float t1, float t2, float t3, float t4, float t5, float t6, float t7)
bool exportMeshNative(const void *object, float cloudVoxelSize, bool regenerateCloud, bool meshing, int textureSize, int textureCount, int normalK, bool optimized, float optimizedVoxelSize, int optimizedDepth, int optimizedMaxPolygons, float optimizedColorRadius, bool optimizedCleanWhitePolygons, int optimizedMinClusterSize, float optimizedMaxTextureDistance, int optimizedMinTextureClusterSize, bool blockRendering)
void save(const std::string &databasePath)
void setMeshDecimationFactor(float value)
bool recoverNative(const void *object, const char *from, const char *to)
void setCloudDensityLevelNative(const void *object, int value)
GLM_FUNC_DECL T angle(detail::tquat< T, P > const &x)
void setGPSNative(const void *object, double stamp, double longitude, double latitude, double altitude, double accuracy, double bearing)
bool startCameraNative(const void *object)
bool writeExportedMesh(const std::string &directory, const std::string &name)
void setLighting(bool enabled)
void setSmoothingNative(const void *object, bool enabled)
void setDepthConfidence(int value)
int renderNative(const void *object)
void setBackgroundColor(float gray)
const gtsam::Symbol key( 'X', 0)
int postProcessingNative(const void *object, int approach)
CEPHES_EXTERN_EXPORT double y1(double x)
int setMappingParameter(const std::string &key, const std::string &value)
void addEnvSensorNative(const void *object, int type, float value)
void setOrthoCropFactor(float value)
void setLightingNative(const void *object, bool enabled)
void setClusterRatio(float value)
void postCameraPoseEvent(float x, float y, float z, float qx, float qy, float qz, float qw, double stamp)
void cancelProcessingNative(const void *object)
void setPausedMappingNative(const void *object, bool paused)
void setMapCloudShown(bool shown)
void initGlContentNative(const void *object)
CEPHES_EXTERN_EXPORT double y0(double x)
void setOrthoCropFactorNative(const void *object, float value)
bool postExportation(bool visualize)
int openDatabase(const std::string &databasePath, bool databaseInMemory, bool optimize, bool clearDatabase)
void setFullResolutionNative(const void *object, bool enabled)
void setTrajectoryModeNative(const void *object, bool enabled)
void setPointSizeNative(const void *object, float value)
void setGPS(const rtabmap::GPS &gps)
void setupSwiftCallbacks(void *classPtr, void(*progressCallback)(void *, int, int), void(*initCallback)(void *, int, const char *), void(*statsUpdatedCallback)(void *, int, int, int, int, float, int, int, int, int, int, int, float, int, float, int, float, float, float, float, int, int, float, float, float, float, float, float))
void setGridRotationNative(const void *object, float value)
void setWireframeNative(const void *object, bool enabled)
void setScreenRotationNative(const void *object, int displayRotation)
void setPausedMapping(bool paused)
void setGraphVisibleNative(const void *object, bool visible)
bool exportMesh(float cloudVoxelSize, bool regenerateCloud, bool meshing, int textureSize, int textureCount, int normalK, bool optimized, float optimizedVoxelSize, int optimizedDepth, int optimizedMaxPolygons, float optimizedColorRadius, bool optimizedCleanWhitePolygons, int optimizedMinClusterSize, float optimizedMaxTextureDistance, int optimizedMinTextureClusterSize, bool blockRendering)
bool postExportationNative(const void *object, bool visualize)
void stopCameraNative(const void *object)
void setCameraNative(const void *object, int type)
void InitializeGLContent()
void setMeshRendering(bool enabled, bool withTexture)
void setLocalizationModeNative(const void *object, bool enabled)
void setNodesFiltering(bool enabled)
void setOdomCloudShown(bool shown)
void setMinCloudDepthNative(const void *object, float value)
void setupCallbacksNative(const void *object, void *classPtr, void(*progressCallback)(void *, int, int), void(*initCallback)(void *, int, const char *), void(*statsUpdatedCallback)(void *, int, int, int, int, float, int, int, int, int, int, int, float, int, float, int, float, float, float, float, int, int, float, float, float, float, float, float))
void addEnvSensor(int type, float value)
StridedVectorType vx(make_vector(x, *n, std::abs(*incx)))
void setBackgroundColorNative(const void *object, float gray)
void setMaxGainRadiusNative(const void *object, float value)
void setTrajectoryMode(bool enabled)
rtabmap
Author(s): Mathieu Labbe
autogenerated on Thu Jul 25 2024 02:50:13