Class RosSensor

Inheritance Relationships

Base Type

  • public rs2::sensor

Class Documentation

class RosSensor : public rs2::sensor

Public Functions

RosSensor(rs2::sensor sensor, std::shared_ptr<Parameters> parameters, std::function<void(rs2::frame)> frame_callback, std::function<void()> update_sensor_func, std::function<void()> hardware_reset_func, std::shared_ptr<diagnostic_updater::Updater> diagnostics_updater, rclcpp::Logger logger, bool force_image_default_qos = false, bool is_rosbag_file = false)
~RosSensor()
void registerSensorParameters()
bool getUpdatedProfiles(std::vector<rs2::stream_profile> &wanted_profiles)
void runFirstFrameInitialization()
virtual bool start(const std::vector<rs2::stream_profile> &profiles)
void stop()
rmw_qos_profile_t getQOS(const stream_index_pair &sip) const
rmw_qos_profile_t getInfoQOS(const stream_index_pair &sip) const
template<class T>
inline bool is() const