4 #ifndef LIBREALSENSE_RS2_SENSOR_HPP 5 #define LIBREALSENSE_RS2_SENSOR_HPP 130 return is_supported > 0;
155 std::vector<const rs2_stream_profile*> profs;
156 profs.reserve(profiles.size());
157 for (
auto&
p : profiles)
159 profs.push_back(
p.get());
164 static_cast<int>(profiles.size()),
221 std::vector<stream_profile> results{};
224 std::shared_ptr<rs2_stream_profile_list> list(
232 for (
auto i = 0;
i <
size;
i++)
236 results.push_back(profile);
248 std::vector<stream_profile> results{};
251 std::shared_ptr<rs2_stream_profile_list> list(
259 for (
auto i = 0;
i <
size;
i++)
263 results.push_back(profile);
275 std::vector<filter> results{};
278 std::shared_ptr<rs2_processing_block_list> list(
286 for (
auto i = 0;
i <
size;
i++)
288 auto f = std::shared_ptr<rs2_processing_block>(
292 results.push_back(
f);
315 operator bool()
const 317 return _sensor !=
nullptr;
320 const std::shared_ptr<rs2_sensor>&
get()
const 343 explicit operator std::shared_ptr<rs2_sensor>() {
return _sensor; }
360 return std::make_shared<sensor>(psens);
386 operator bool()
const {
return _sensor.get() !=
nullptr; }
402 operator bool()
const {
return _sensor.get() !=
nullptr; }
418 operator bool()
const {
return _sensor.get() !=
nullptr; }
451 operator bool()
const {
return _sensor.get() !=
nullptr; }
479 operator bool()
const {
return _sensor.get() !=
nullptr; }
507 operator bool()
const {
return _sensor.get() !=
nullptr; }
549 std::vector<uint8_t> results;
563 results = std::vector<uint8_t>(
start, start +
size);
618 operator bool()
const {
return _sensor.get() !=
nullptr; }
662 operator bool()
const {
return _sensor.get() !=
nullptr; }
680 operator bool()
const {
return _sensor.get() !=
nullptr; }
742 operator bool()
const {
return _sensor.get() !=
nullptr; }
770 operator bool()
const {
return _sensor.get() !=
nullptr; }
778 std::vector< stream_profile > results;
781 std::shared_ptr< rs2_stream_profile_list > list(
789 for(
auto i = 0;
i <
size;
i++ )
793 results.push_back( profile );
800 #endif // LIBREALSENSE_RS2_SENSOR_HPP T on_notification_function
notification(rs2_notification *nt)
std::vector< uint8_t > export_localization_map() const
rs2_camera_info
Read-only strings that can be queried from the device. Not all information attributes are available o...
pose_sensor(std::shared_ptr< rs2_sensor > dev)
float rs2_get_depth_scale(rs2_sensor *sensor, rs2_error **error)
float get_depth_scale() const
calibrated_sensor(sensor s)
std::string get_serialized_data() const
bool operator==(const plane &lhs, const plane &rhs)
std::vector< stream_profile > get_active_streams() const
void on_notification(rs2_notification *_notification) override
int rs2_get_static_node(const rs2_sensor *sensor, const char *guid, rs2_vector *pos, rs2_quaternion *orient, rs2_error **error)
float rs2_get_max_usable_depth_range(rs2_sensor const *sensor, rs2_error **error)
void override_intrinsics(rs2_intrinsics const &intr)
Video DSM (Digital Sync Module) parameters for calibration (same layout as in FW ac_depth_params) Thi...
void set_notifications_callback(T callback) const
std::vector< filter > get_recommended_filters() const
void rs2_set_region_of_interest(const rs2_sensor *sensor, int min_x, int min_y, int max_x, int max_y, rs2_error **error)
sets the active region of interest to be used by auto-exposure algorithm
rs2_log_severity get_severity() const
const unsigned char * rs2_get_raw_data(const rs2_raw_data_buffer *buffer, rs2_error **error)
int rs2_import_localization_map(const rs2_sensor *sensor, const unsigned char *lmap_blob, unsigned int blob_size, rs2_error **error)
void rs2_stop(const rs2_sensor *sensor, rs2_error **error)
float get_max_usable_depth_range() const
debug_stream_sensor(sensor s)
depth_stereo_sensor(sensor s)
const char * rs2_get_notification_serialized_data(rs2_notification *notification, rs2_error **error)
GLsizei const GLchar *const * string
std::string get_description() const
rs2_log_severity rs2_get_notification_severity(rs2_notification *notification, rs2_error **error)
void rs2_delete_raw_data(const rs2_raw_data_buffer *buffer)
sensor(std::shared_ptr< rs2_sensor > dev)
void set_region_of_interest(const region_of_interest &roi)
rs2_stream_profile_list * rs2_get_active_streams(rs2_sensor *sensor, rs2_error **error)
int rs2_get_raw_data_size(const rs2_raw_data_buffer *buffer, rs2_error **error)
rs2_stream_profile_list * rs2_get_stream_profiles(rs2_sensor *sensor, rs2_error **error)
void rs2_open(rs2_sensor *device, const rs2_stream_profile *profile, rs2_error **error)
notifications_callback(T on_notification)
def info(name, value, persistent=False)
Quaternion used to represent rotation.
rs2_stream_profile_list * rs2_get_debug_stream_profiles(rs2_sensor *sensor, rs2_error **error)
region_of_interest get_region_of_interest() const
std::string _serialized_data
void rs2_override_dsm_params(rs2_sensor const *sensor, rs2_dsm_params const *p_params, rs2_error **error)
std::shared_ptr< rs2_sensor > _sensor
max_usable_range_sensor(sensor s)
float get_stereo_baseline() const
float rs2_get_stereo_baseline(rs2_sensor *sensor, rs2_error **error)
int rs2_get_recommended_processing_blocks_count(const rs2_processing_block_list *list, rs2_error **error)
void rs2_delete_sensor(rs2_sensor *sensor)
rs2_notification_category _category
void rs2_get_region_of_interest(const rs2_sensor *sensor, int *min_x, int *min_y, int *max_x, int *max_y, rs2_error **error)
gets the active region of interest to be used by auto-exposure algorithm
rs2_time_t rs2_get_notification_timestamp(rs2_notification *notification, rs2_error **error)
int rs2_remove_static_node(const rs2_sensor *sensor, const char *guid, rs2_error **error)
depth_sensor(std::shared_ptr< rs2_sensor > dev)
const rs2_stream_profile * rs2_get_stream_profile(const rs2_stream_profile_list *list, int index, rs2_error **error)
rs2_dsm_params get_dsm_params() const
void rs2_set_notifications_callback_cpp(const rs2_sensor *sensor, rs2_notifications_callback *callback, rs2_error **error)
void rs2_reset_sensor_calibration(rs2_sensor const *sensor, rs2_error **error)
BOOST_DEDUCED_TYPENAME optional< T >::reference_const_type get(optional< T > const &opt)
void rs2_delete_processing_block(rs2_processing_block *block)
GLenum const GLfloat * params
int rs2_supports_sensor_info(const rs2_sensor *sensor, rs2_camera_info info, rs2_error **error)
void rs2_delete_recommended_processing_blocks(rs2_processing_block_list *list)
bool supports(rs2_camera_info info) const
bool supports(rs2_option option) const
rs2_log_severity _severity
static void handle(rs2_error *e)
rs2_sensor * get_sensor()
void rs2_override_extrinsics(const rs2_sensor *sensor, const rs2_extrinsics *extrinsics, rs2_error **error)
Override extrinsics of a given sensor that supports calibrated_sensor.
rs2_notification_category get_category() const
void open(const std::vector< stream_profile > &profiles) const
std::vector< stream_profile > get_debug_stream_profiles() const
bool load_wheel_odometery_config(const std::vector< uint8_t > &odometry_config_buf) const
Cross-stream extrinsics: encodes the topology describing how the different devices are oriented...
void override_extrinsics(rs2_extrinsics const &extr)
void rs2_get_dsm_params(rs2_sensor const *sensor, rs2_dsm_params *p_params_out, rs2_error **error)
int rs2_is_sensor_extendable_to(const rs2_sensor *sensor, rs2_extension extension, rs2_error **error)
3D vector in Euclidean coordinate space
bool set_static_node(const std::string &guid, const rs2_vector &pos, const rs2_quaternion &orient) const
rs2_notification_category
Category of the librealsense notification.
bool import_localization_map(const std::vector< uint8_t > &lmap_buf) const
const rs2_stream_profile * get() const
void rs2_delete_stream_profiles_list(rs2_stream_profile_list *list)
void rs2_close(const rs2_sensor *sensor, rs2_error **error)
typename::boost::move_detail::remove_reference< T >::type && move(T &&t) BOOST_NOEXCEPT
options & operator=(const options &other)
void open(const stream_profile &profile) const
void rs2_open_multiple(rs2_sensor *device, const rs2_stream_profile **profiles, int count, rs2_error **error)
void rs2_start_cpp(const rs2_sensor *sensor, rs2_frame_callback *callback, rs2_error **error)
rs2_notification_category rs2_get_notification_category(rs2_notification *notification, rs2_error **error)
double get_timestamp() const
rs2_processing_block * rs2_get_processing_block(const rs2_processing_block_list *list, int index, rs2_error **error)
bool send_wheel_odometry(uint8_t wo_sensor_id, uint32_t frame_num, const rs2_vector &translational_velocity)
int rs2_set_static_node(const rs2_sensor *sensor, const char *guid, const rs2_vector pos, const rs2_quaternion orient, rs2_error **error)
bool get_static_node(const std::string &guid, rs2_vector &pos, rs2_quaternion &orient) const
const rs2_raw_data_buffer * rs2_export_localization_map(const rs2_sensor *sensor, rs2_error **error)
const char * get_info(rs2_camera_info info) const
const char * rs2_get_sensor_info(const rs2_sensor *sensor, rs2_camera_info info, rs2_error **error)
sensor & operator=(const sensor &other)
const char * rs2_get_notification_description(rs2_notification *notification, rs2_error **error)
int rs2_get_stream_profiles_count(const rs2_stream_profile_list *list, rs2_error **error)
int rs2_load_wheel_odometry_config(const rs2_sensor *sensor, const unsigned char *odometry_config_buf, unsigned int blob_size, rs2_error **error)
bool remove_static_node(const std::string &guid) const
rs2_log_severity
Severity of the librealsense logger.
std::vector< stream_profile > get_stream_profiles() const
rs2_processing_block_list * rs2_get_recommended_processing_blocks(rs2_sensor *sensor, rs2_error **error)
int rs2_send_wheel_odometry(const rs2_sensor *sensor, char wo_sensor_id, unsigned int frame_num, const rs2_vector translational_velocity, rs2_error **error)
void rs2_override_intrinsics(const rs2_sensor *sensor, const rs2_intrinsics *intrinsics, rs2_error **error)
Override intrinsics of a given sensor that supports calibrated_sensor.
sensor & operator=(const std::shared_ptr< rs2_sensor > other)
GeneratorWrapper< T > map(Func &&function, GeneratorWrapper< U > &&generator)
wheel_odometer(std::shared_ptr< rs2_sensor > dev)
std::shared_ptr< sensor > sensor_from_frame(frame f)
void start(T callback) const
void override_dsm_params(rs2_dsm_params const ¶ms)