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 |
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) |
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.
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.
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.
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.
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.
stream_manager | |
stream_name | |
frame_msg | |
publisher |
Definition at line 26 of file subscriber_callbacks.cpp.
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.
Definition at line 30 of file streamer.h.