Class NamedFilter

Inheritance Relationships

Derived Types

Class Documentation

class NamedFilter

Subclassed by realsense2_camera::AlignDepthFilter, realsense2_camera::PointcloudFilter

Public Functions

NamedFilter(std::shared_ptr<rs2::filter> filter, std::shared_ptr<Parameters> parameters, rclcpp::Logger logger, bool is_enabled = false, bool is_set_parameters = true)
inline bool is_enabled()
rs2::frameset Process(rs2::frameset frameset)
rs2::frame Process(rs2::frame frame)

Public Members

std::shared_ptr<rs2::filter> _filter

Protected Functions

void setParameters(std::function<void(const rclcpp::Parameter&)> enable_param_func = std::function<void(const rclcpp::Parameter&)>())

Protected Attributes

bool _is_enabled
SensorParams _params
std::vector<std::string> _parameters_names
rclcpp::Logger _logger