Open 3D Engine ROS2 Gem API Reference 23.10.0
O3DE is an open-source, fully-featured, high-fidelity, modular 3D engine for building games and simulations, available to every industry.
ROS2::CameraPostProcessingRequests Class Referenceabstract

#include <CameraPostProcessingRequestBus.h>

Inherits AZ::EBusSharedDispatchTraits< CameraPostProcessingRequests >.

Public Types

using BusIdType = AZ::EntityId
 

Public Member Functions

virtual void ApplyPostProcessing (sensor_msgs::msg::Image &image)=0
 
virtual bool SupportsFormat (const AZStd::string &encodingFormat)=0
 

Static Public Attributes

static constexpr AZ::EBusAddressPolicy AddressPolicy = AZ::EBusAddressPolicy::ById
 
static constexpr AZ::EBusHandlerPolicy HandlerPolicy = AZ::EBusHandlerPolicy::Multiple
 

Detailed Description

Interface class that allows to add post-processing to the pipeline

Each function call can be processed without blocking Bus for other dispatches. Do not use connects / disconnects to this bus during event dispatch, as they are not allowed for this concurrency model. Those constraints allow for processing multiple camera frames in the same time. Bus implementations should allow for asynchronous execution of provided functions.

Member Function Documentation

◆ ApplyPostProcessing()

virtual void ROS2::CameraPostProcessingRequests::ApplyPostProcessing ( sensor_msgs::msg::Image &  image)
pure virtual

Apply post-processing function, if any implementations to the bus are in the entity.

Parameters
imagestandard image message passed as a reference. It will be changed through post-processing.
Note
you should check whether the encoding format is supported first with SupportsFormat.

◆ SupportsFormat()

virtual bool ROS2::CameraPostProcessingRequests::SupportsFormat ( const AZStd::string &  encodingFormat)
pure virtual

Query whether a particular image encoding is supported by registered postprocessing.

Parameters
encodingFormatname of the format.

The documentation for this class was generated from the following file: