Classes | Namespaces | Functions | Variables
lidar_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/PointCloud2.h"
#include <sensor_msgs/PointField.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <libL3Cam.h>
#include <beamagine.h>
#include <beamErrors.h>
Include dependency graph for lidar_stream.cpp:

Go to the source code of this file.

Classes

class  l3cam_ros::LidarStream
 

Namespaces

 l3cam_ros
 

Functions

int main (int argc, char **argv)
 
void PointCloudThread (ros::Publisher publisher)
 

Variables

bool g_listening = false
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 260 of file lidar_stream.cpp.

◆ PointCloudThread()

void PointCloudThread ( ros::Publisher  publisher)

Definition at line 54 of file lidar_stream.cpp.

Variable Documentation

◆ g_listening

bool g_listening = false

Definition at line 52 of file lidar_stream.cpp.



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