Namespaces | Macros | Typedefs | Functions
include/sick_scansegment_xd/common.h File Reference
#include "sick_scan/sick_scan_base.h"
#include <algorithm>
#include <cassert>
#include <chrono>
#include <cmath>
#include <fstream>
#include <iomanip>
#include <iostream>
#include <list>
#include <map>
#include <string>
#include <sstream>
#include <thread>
#include <vector>
#include <sys/stat.h>
#include <sys/types.h>
Include dependency graph for include/sick_scansegment_xd/common.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 sick_scansegment_xd
 

Macros

#define __SICK_SCANSEGMENT_XD_COMMON_H
 
#define _USE_MATH_DEFINES
 
#define GETCH()   0
 
#define KBHIT()   false
 
#define localtime_s(a, b)   localtime_r(b,a)
 
#define SCANDATA_COMPACT   2
 
#define SCANDATA_MSGPACK   1
 
#define SPRINTF   sprintf
 

Typedefs

typedef std::chrono::system_clock chrono_system_clock
 
typedef std::chrono::time_point< std::chrono::system_clock > chrono_system_time
 
typedef ros_sensor_msgs::Imu ImuMsg
 
typedef rosPublisher< ImuMsgImuMsgPublisher
 
typedef ros_sensor_msgs::LaserScan LaserScanMsg
 
typedef rosPublisher< LaserScanMsgLaserscanMsgPublisher
 
typedef ros_sensor_msgs::PointCloud2 PointCloud2Msg
 
typedef rosPublisher< PointCloud2MsgPointCloud2MsgPublisher
 
typedef ros_sensor_msgs::PointField PointField
 
typedef rosTime rosClock
 
typedef int rosQoS
 

Functions

static std::string sick_scansegment_xd::FilenameNoPathNoExtension (const std::string &filepath)
 
static bool sick_scansegment_xd::FileReadable (const std::string &filename)
 
template<typename T >
static std::string sick_scansegment_xd::FormatNumber (const T &number, int width=-1, bool setfill=false, bool setfixed=false, int precision=-1)
 
static bool sick_scansegment_xd::MkDir (const std::string &folder)
 
static double sick_scansegment_xd::Seconds (const chrono_system_time &timestamp_start, const chrono_system_time &timestamp_end=chrono_system_clock::now())
 

Macro Definition Documentation

◆ __SICK_SCANSEGMENT_XD_COMMON_H

#define __SICK_SCANSEGMENT_XD_COMMON_H

Definition at line 58 of file include/sick_scansegment_xd/common.h.

◆ _USE_MATH_DEFINES

#define _USE_MATH_DEFINES

Definition at line 60 of file include/sick_scansegment_xd/common.h.

◆ GETCH

#define GETCH ( )    0

Definition at line 87 of file include/sick_scansegment_xd/common.h.

◆ KBHIT

#define KBHIT ( )    false

Definition at line 86 of file include/sick_scansegment_xd/common.h.

◆ localtime_s

#define localtime_s (   a,
 
)    localtime_r(b,a)

Definition at line 85 of file include/sick_scansegment_xd/common.h.

◆ SCANDATA_COMPACT

#define SCANDATA_COMPACT   2

Definition at line 93 of file include/sick_scansegment_xd/common.h.

◆ SCANDATA_MSGPACK

#define SCANDATA_MSGPACK   1

Definition at line 92 of file include/sick_scansegment_xd/common.h.

◆ SPRINTF

#define SPRINTF   sprintf

Definition at line 88 of file include/sick_scansegment_xd/common.h.

Typedef Documentation

◆ chrono_system_clock

typedef std::chrono::system_clock chrono_system_clock

Definition at line 133 of file include/sick_scansegment_xd/common.h.

◆ chrono_system_time

typedef std::chrono::time_point<std::chrono::system_clock> chrono_system_time

Definition at line 134 of file include/sick_scansegment_xd/common.h.

◆ ImuMsg

typedef ros_sensor_msgs::Imu ImuMsg

Definition at line 125 of file include/sick_scansegment_xd/common.h.

◆ ImuMsgPublisher

Definition at line 126 of file include/sick_scansegment_xd/common.h.

◆ LaserScanMsg

typedef ros_sensor_msgs::LaserScan LaserScanMsg

Definition at line 123 of file include/sick_scansegment_xd/common.h.

◆ LaserscanMsgPublisher

Definition at line 124 of file include/sick_scansegment_xd/common.h.

◆ PointCloud2Msg

typedef ros_sensor_msgs::PointCloud2 PointCloud2Msg

Definition at line 121 of file include/sick_scansegment_xd/common.h.

◆ PointCloud2MsgPublisher

Definition at line 122 of file include/sick_scansegment_xd/common.h.

◆ PointField

typedef ros_sensor_msgs::PointField PointField

Definition at line 127 of file include/sick_scansegment_xd/common.h.

◆ rosClock

typedef rosTime rosClock

Definition at line 128 of file include/sick_scansegment_xd/common.h.

◆ rosQoS

typedef int rosQoS

Definition at line 129 of file include/sick_scansegment_xd/common.h.



sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:13