Functions | Variables
DroneCam.cpp File Reference
#include <libavcodec/avcodec.h>
#include <libswscale/swscale.h>
#include <libavutil/pixfmt.h>
#include <iostream>
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <eyantra_drone/liblewei.h>
#include <std_msgs/String.h>
#include <opencv2/opencv.hpp>
Include dependency graph for DroneCam.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
 
static void read_buffer (void *lpParam, lewei_video_frame *pFrame)
 

Variables

image_transport::Publisher cam_pub
 
ros::Publisher chatter_pub
 
sensor_msgs::ImagePtr msg
 
AVCodecContext * pCodecCtxc
 
AVCodec * pdecode
 
uint8_t * pframe_pixel
 
SwsContext * pSwsCtx
 
AVFrame * pVideoFrameIn
 
AVFrame * pVideoFrameOut
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 68 of file DroneCam.cpp.

◆ read_buffer()

static void read_buffer ( void *  lpParam,
lewei_video_frame pFrame 
)
static

Definition at line 88 of file DroneCam.cpp.

Variable Documentation

◆ cam_pub

Definition at line 55 of file DroneCam.cpp.

◆ chatter_pub

ros::Publisher chatter_pub

Definition at line 54 of file DroneCam.cpp.

◆ msg

sensor_msgs::ImagePtr msg

Definition at line 56 of file DroneCam.cpp.

◆ pCodecCtxc

AVCodecContext* pCodecCtxc

Definition at line 60 of file DroneCam.cpp.

◆ pdecode

AVCodec* pdecode

Definition at line 61 of file DroneCam.cpp.

◆ pframe_pixel

uint8_t* pframe_pixel

Definition at line 58 of file DroneCam.cpp.

◆ pSwsCtx

SwsContext* pSwsCtx

Definition at line 62 of file DroneCam.cpp.

◆ pVideoFrameIn

AVFrame* pVideoFrameIn

Definition at line 59 of file DroneCam.cpp.

◆ pVideoFrameOut

AVFrame * pVideoFrameOut

Definition at line 59 of file DroneCam.cpp.



edrone_client
Author(s): Simranjeet Singh
autogenerated on Mon Feb 28 2022 22:20:15