Class CameraDriverUv

Inheritance Relationships

Base Type

Class Documentation

class CameraDriverUv : public camera_aravis2::CameraDriver

Public Functions

explicit CameraDriverUv(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())

Initialization constructor.

Parameters:

options[in] Node options.

virtual ~CameraDriverUv()

Default destructor.

Protected Functions

virtual bool setTechSpecificTlControlSettings() override

Method to set UsbVision specific transport layer control settings of the camera.

Returns:

True if successful. False, otherwise.

virtual int discoverNumberOfStreams() override

Discover number of available camera streams. In case of USB3 cameras this will return 1.

virtual void tuneArvStream(ArvStream *p_stream) const override

Tune specific parameters for Aravis streams.

Parameters:

p_stream[in] Pointer to Aravis stream.

virtual void postFrameProcessingCallback(const uint stream_id) override

Callback method to inject short processing routines after the publication of each frame.

This is called within the processing loop of processStreamBuffer.

Note

This should not hold heavy processing as it will the delay the processing of the next frame within the stream buffer.

Parameters:

stream_id[in] ID of stream for which the buffer is to be processed.

Protected Attributes

std::shared_ptr<UvTransportLayerControl> p_uv_tl_control_

Pointer to Uv-Specific transport layer control settings.