Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
Aws::Kinesis Namespace Reference

Namespaces

 Model
 

Classes

class  DefaultClientCallbackProvider
 
class  DefaultStreamCallbackProvider
 
class  KinesisClientFacade
 
class  KinesisStreamManager
 
class  KinesisStreamManagerInterface
 
class  KinesisVideoProducerImpl
 
class  KinesisVideoProducerInterface
 
class  KinesisVideoStreamImpl
 
class  KinesisVideoStreamInterface
 
class  ProducerSdkAWSCredentialsProvider
 
class  RosStreamSubscriptionInstaller
 
class  StreamDefinitionProvider
 
class  StreamerNode
 
struct  StreamSubscriptionDescriptor
 
class  StreamSubscriptionInstaller
 

Typedefs

typedef void(* ImageTransportCallbackFn) (const KinesisStreamManagerInterface &stream_manager, std::string stream_name, const sensor_msgs::ImageConstPtr &image)
 
typedef enum Aws::Kinesis::kinesis_manager_status_e KinesisManagerStatus
 
typedef int KinesisStreamInputType
 
typedef enum Aws::Kinesis::kinesis_stream_ros_input_type_e KinesisStreamRosInputType
 
typedef void(* KinesisVideoFrameTransportCallbackFn) (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg)
 
typedef void(* RekognitionEnabledKinesisVideoFrameTransportCallbackFn) (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg, const ros::Publisher &publisher)
 
typedef std::function< bool(const StreamSubscriptionDescriptor &descriptor)> SubscriberSetupFn
 

Enumerations

enum  kinesis_manager_status_e
 
enum  kinesis_stream_ros_input_type_e { KINESIS_STREAM_INPUT_TYPE_KINESIS_VIDEO_FRAME, KINESIS_STREAM_INPUT_TYPE_IMAGE_TRANSPORT, KINESIS_STREAM_INPUT_TYPE_REKOGNITION_ENABLED_KINESIS_VIDEO_FRAME }
 

Functions

std::unique_ptr< com::amazonaws::kinesis::video::CredentialProvider > CreateDefaultCredentialProvider ()
 
Aws::Client::ParameterPath GetKinesisVideoParameter (const char *parameter_name)
 
Aws::Client::ParameterPath GetStreamParameterPath (int stream_idx, const char *parameter_name)
 
Aws::Client::ParameterPath GetStreamParameterPrefix (int stream_idx)
 
void ImageTransportCallback (const KinesisStreamManagerInterface &stream_manager, std::string stream_name, const sensor_msgs::ImageConstPtr &image)
 
void KinesisVideoFrameTransportCallback (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg)
 
void RekognitionEnabledKinesisVideoFrameTransportCallback (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg, const ros::Publisher &publisher)
 

Variables

constexpr uint32_t kDefaultMessageQueueSize
 
constexpr uint32_t kDefaultNumberOfSpinnerThreads = 1
 
constexpr uint16_t kDefaultRecordsLimitForRekognitionResults
 
 KINESIS_MANAGER_STATUS_BASE64DECODE_FAILED
 
 KINESIS_MANAGER_STATUS_CREATESTREAMSYNC_FAILED
 
 KINESIS_MANAGER_STATUS_DEFAULT_CREDENTIAL_PROVIDER_CREATION_FAILED
 
 KINESIS_MANAGER_STATUS_EMPTY_STREAM_NAME
 
 KINESIS_MANAGER_STATUS_ERROR_BASE
 
 KINESIS_MANAGER_STATUS_GET_RECORDS_FAILED
 
 KINESIS_MANAGER_STATUS_GET_RECORDS_THROTTLED
 
 KINESIS_MANAGER_STATUS_GET_SHARD_ITERATOR_FAILED
 
 KINESIS_MANAGER_STATUS_GET_STREAM_DEFINITION_FAILED
 
 KINESIS_MANAGER_STATUS_INVALID_INPUT
 
 KINESIS_MANAGER_STATUS_LIST_SHARDS_EMPTY
 
 KINESIS_MANAGER_STATUS_LIST_SHARDS_FAILED
 
 KINESIS_MANAGER_STATUS_MALLOC_FAILED
 
 KINESIS_MANAGER_STATUS_NO_STREAMS_SPECIFIED
 
 KINESIS_MANAGER_STATUS_PROCESS_CODEC_DATA_STREAM_CONFIG_NOT_FOUND
 
 KINESIS_MANAGER_STATUS_PUTFRAME_FAILED
 
 KINESIS_MANAGER_STATUS_PUTFRAME_STREAM_NOT_FOUND
 
 KINESIS_MANAGER_STATUS_PUTMETADATA_FAILED
 
 KINESIS_MANAGER_STATUS_PUTMETADATA_STREAM_NOT_FOUND
 
 KINESIS_MANAGER_STATUS_STREAM_ALREADY_EXISTS
 
 KINESIS_MANAGER_STATUS_SUBSCRIPTION_INSTALLATION_FAILED
 
 KINESIS_MANAGER_STATUS_SUBSCRIPTION_INSTALLER_NOT_FOUND
 
 KINESIS_MANAGER_STATUS_SUCCESS
 
 KINESIS_MANAGER_STATUS_VIDEO_PRODUCER_ALREADY_INITIALIZED
 
 KINESIS_MANAGER_STATUS_VIDEO_PRODUCER_NOT_INITIALIZED
 
const struct Aws::Kinesis:: { ... }  kinesis_video
 
const char * log4cplus_config
 
const char * message_queue_size
 
const char * prefix
 
const char * rekognition_data_stream
 
const char * rekognition_topic_name
 
const struct Aws::Kinesis:: { ... }  stream
 
const char * stream_count
 
const char * stream_name
 
const char * stream_namespace
 
const struct Aws::Kinesis:: { ... }  subscription_queue_size
 
const struct Aws::Kinesis:: { ... }  subscription_topic
 
const char * topic_name
 
const char * topic_type
 

Typedef Documentation

typedef void(* Aws::Kinesis::ImageTransportCallbackFn) (const KinesisStreamManagerInterface &stream_manager, std::string stream_name, const sensor_msgs::ImageConstPtr &image)

Definition at line 49 of file ros_stream_subscription_installer.h.

Stream type and the appropriate subscriber callback functions are inferred from the topic type the node subscribes to.

typedef void(* Aws::Kinesis::KinesisVideoFrameTransportCallbackFn) (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg)

Definition at line 40 of file ros_stream_subscription_installer.h.

typedef void(* Aws::Kinesis::RekognitionEnabledKinesisVideoFrameTransportCallbackFn) (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg, const ros::Publisher &publisher)

Definition at line 44 of file ros_stream_subscription_installer.h.

Enumeration Type Documentation

Stream type and the appropriate subscriber callback functions are inferred from the topic type the node subscribes to.

Enumerator
KINESIS_STREAM_INPUT_TYPE_KINESIS_VIDEO_FRAME 
KINESIS_STREAM_INPUT_TYPE_IMAGE_TRANSPORT 
KINESIS_STREAM_INPUT_TYPE_REKOGNITION_ENABLED_KINESIS_VIDEO_FRAME 

Definition at line 31 of file ros_stream_subscription_installer.h.

Function Documentation

void Aws::Kinesis::ImageTransportCallback ( const KinesisStreamManagerInterface stream_manager,
std::string  stream_name,
const sensor_msgs::ImageConstPtr &  image 
)

ROS1-specific callback that handles a sensor_msgs::Image input and uses the stream manager to perform a PutFrame operation.

Parameters
stream_manager
stream_name
image

Definition at line 111 of file subscriber_callbacks.cpp.

void Aws::Kinesis::KinesisVideoFrameTransportCallback ( KinesisStreamManagerInterface stream_manager,
std::string  stream_name,
const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &  frame_msg 
)

ROS1-specific callback that handles a kinesis_video_msgs::KinesisVideoFrame input and uses the stream manager to perform a PutFrame operation.

Parameters
stream_manager
stream_name
frame_msg

Definition at line 49 of file subscriber_callbacks.cpp.

void Aws::Kinesis::RekognitionEnabledKinesisVideoFrameTransportCallback ( KinesisStreamManagerInterface stream_manager,
std::string  stream_name,
const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &  frame_msg,
const ros::Publisher publisher 
)

This callback uses the above KinesisVideoFrameTransportCallback, then fetches and publishes the analysis results from AWS Rekognition.

Parameters
stream_manager
stream_name
frame_msg
publisher

Definition at line 26 of file subscriber_callbacks.cpp.

Variable Documentation

constexpr uint32_t Aws::Kinesis::kDefaultNumberOfSpinnerThreads = 1

By default, we use one thread to handle incoming messages. You may specify a different setting via the "spinner_thread_count" parameter.

Note
There are no ordering guarantees; assumptions can be made when dealing with real-time video streaming: Since frame duration is 1/fps seconds - ample time to process a message - misordering of frames is highly unlikely (but still possible). Finally, message timestamps can be used to validate (or fix) the order by the receiving application.

Definition at line 30 of file streamer.h.



kinesis_video_streamer
Author(s): AWS RoboMaker
autogenerated on Fri Mar 5 2021 03:29:15