Classes | Namespaces | Functions | Variables
thermal_stream.cpp File Reference
#include "sensor_stream.hpp"
#include <sys/socket.h>
#include <netinet/in.h>
#include <netdb.h>
#include <stdio.h>
#include <string.h>
#include <arpa/inet.h>
#include <stdint.h>
#include <unistd.h>
#include <pthread.h>
#include <thread>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <libL3Cam.h>
#include <beamagine.h>
#include <beamErrors.h>
Include dependency graph for thermal_stream.cpp:

Go to the source code of this file.

Classes

class  l3cam_ros::ThermalStream
 

Namespaces

 l3cam_ros
 

Functions

void FloatImageThread (ros::Publisher publisher)
 
void ImageThread (image_transport::Publisher publisher)
 
int main (int argc, char **argv)
 
bool openSocket (int &m_socket_descriptor, sockaddr_in &m_socket, std::string &m_address, int m_udp_port)
 

Variables

bool g_listening = false
 

Function Documentation

◆ FloatImageThread()

void FloatImageThread ( ros::Publisher  publisher)

Definition at line 216 of file thermal_stream.cpp.

◆ ImageThread()

void ImageThread ( image_transport::Publisher  publisher)

Definition at line 101 of file thermal_stream.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 343 of file thermal_stream.cpp.

◆ openSocket()

bool openSocket ( int &  m_socket_descriptor,
sockaddr_in &  m_socket,
std::string &  m_address,
int  m_udp_port 
)

Definition at line 59 of file thermal_stream.cpp.

Variable Documentation

◆ g_listening

bool g_listening = false

Definition at line 57 of file thermal_stream.cpp.



l3cam_ros
Author(s): Beamagine
autogenerated on Wed May 28 2025 02:53:15