Class Parameters
- Defined in File parameters.hpp 
Nested Relationships
Nested Types
Class Documentation
- 
class Parameters
- Public Functions - 
void declareStaticParameters()
- Declare read-only parameters 
 - 
void declareOutputParameters()
- Declare parameters for output formats 
 - 
void declareDeviceParameters(V4l2CameraDevice const &device)
- Declare parameters by querying device 
 - 
void setParameterChangedCallback(std::function<void(rclcpp::Parameter)> callback)
- Set callbacks for inspecting and applying parameter changes 
 - 
inline rclcpp::Parameter getParameter(std::string const &name) const
 - 
inline const rclcpp::ParameterValue &getParameterValue(std::string const &name) const
 - 
template<typename T>
 inline decltype(auto) getValue(std::string const &name) const
 - 
inline std::string getVideoDevice() const
 - 
inline std::string getCameraInfoUrl() const
 - 
inline std::string getCameraFrameId() const
 - 
inline std::string getOutputEncoding() const
 - 
inline std::string getPixelFormat() const
 - 
inline std::vector<int64_t> getImageSize() const
 - 
inline std::vector<rclcpp::Parameter> getControlParameters() const
 - 
inline bool isControlParameter(rclcpp::Parameter const ¶meter) const
 - 
inline int32_t getControlId(std::string const &name) const
 - 
inline int32_t getControlId(rclcpp::Parameter const ¶m) const
 
- 
void declareStaticParameters()