4 URealSenseOption::URealSenseOption(
const FObjectInitializer& ObjectInitializer) : Super(ObjectInitializer)
56 NewValue = FMath::RoundToFloat(NewValue /
Range.Step) *
Range.Step;
63 this->
Value = NewValue;
float rs2_get_option(const rs2_options *options, rs2_option option, rs2_error **error)
const char * get_message() const
rs2_option
Defines general configuration controls. These can generally be mapped to camera UVC controls...
const char * rs2_option_to_string(rs2_option option)
::sensor_msgs::Range_< std::allocator< void > > Range
void SetType(ERealSenseOptionType Type)
#define REALSENSE_ERR(Format,...)
IMGUI_API void Value(const char *prefix, bool b)
void rs2_get_option_range(const rs2_options *sensor, rs2_option option, float *min, float *max, float *step, float *def, rs2_error **error)
void SetHandle(struct rs2_options *Handle)
virtual ~URealSenseOption()
const char * rs2_get_option_description(const rs2_options *options, rs2_option option, rs2_error **error)
FString uestr(const char *str)
struct rs2_options * GetHandle()
void SetValue(float Value)
void rs2_set_option(const rs2_options *options, rs2_option option, float value, rs2_error **error)