#include <aws/core/utils/logging/LogMacros.h>#include <kinesis_video_streamer/subscriber_callbacks.h>#include <std_msgs/String.h>
Go to the source code of this file.
Namespaces | |
| Aws | |
| Aws::Kinesis | |
Macros | |
| #define | PUTFRAME_LOG_INTERVAL_IN_SECONDS (10) |
Functions | |
| void | Aws::Kinesis::ImageTransportCallback (const KinesisStreamManagerInterface &stream_manager, std::string stream_name, const sensor_msgs::ImageConstPtr &image) |
| void | Aws::Kinesis::KinesisVideoFrameTransportCallback (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg) |
| void | Aws::Kinesis::RekognitionEnabledKinesisVideoFrameTransportCallback (KinesisStreamManagerInterface &stream_manager, std::string stream_name, const kinesis_video_msgs::KinesisVideoFrame::ConstPtr &frame_msg, const ros::Publisher &publisher) |
| #define PUTFRAME_LOG_INTERVAL_IN_SECONDS (10) |
Definition at line 20 of file subscriber_callbacks.cpp.