Class OBCameraNode

Nested Relationships

Nested Types

Class Documentation

class OBCameraNode

Public Functions

OBCameraNode(rclcpp::Node *node, std::shared_ptr<ob::Device> device, std::shared_ptr<Parameters> parameters, bool use_intra_process = false)
template<class T>
void setAndGetNodeParameter(T &param, const std::string &param_name, const T &default_value, const rcl_interfaces::msg::ParameterDescriptor &parameter_descriptor = rcl_interfaces::msg::ParameterDescriptor())
~OBCameraNode() noexcept
void clean() noexcept
template<typename Func>
inline auto withDeviceLock(Func &&func) -> decltype(func())
void rebootDevice()
void startStreams()
void startIMUSyncStream()
void startIMU()
int openSocSyncPwmTrigger(uint16_t fps)
int closeSocSyncPwmTrigger()
void startGmslTrigger()
void stopGmslTrigger()
inline bool isParamCalibrated() const
inline void getColorStatus(orbbec_camera_msgs::msg::DeviceStatus &status_msg)
inline void getDepthStatus(orbbec_camera_msgs::msg::DeviceStatus &status_msg)
inline bool checkUserCalibrationReady()