1 package com.intel.realsense.librealsense;
3 import android.util.Log;
19 return new Device(deviceHandle);
21 Log.e(TAG, e.getMessage());
46 private static native
boolean nContainsDevice(
long handle,
long deviceHandle);
47 private static native
void nRelease(
long handle);
::rosgraph_msgs::Log_< std::allocator< void > > Log
void onDevice(Device device)
static native boolean nContainsDevice(long handle, long deviceHandle)
GLuint64 GLenum void * handle
::std_msgs::String_< std::allocator< void > > String
static native long nCreateDevice(long handle, int index)
boolean containesDevice(Device device)
static native int nGetDeviceCount(long handle)
static native void nRelease(long handle)
Device createDevice(int index)