#include <sick_scan/pointcloud_utils.h>
#include "toojpeg.h"
Go to the source code of this file.
|
static void | drawLine (unsigned char *pixel, int wi, int hi, int numColorChannel, int startpoint[2], int endpoint[2], float color[3]) |
|
static void | drawText (unsigned char *pixel, int wi, int hi, int numColorChannel, const std::string &text, int pos[2], float color[3]) |
|
void | jpegOutputCallback (unsigned char oneByte) |
|
void | plotPointCloud (const ros_sensor_msgs::PointCloud2 &cloud_, int intervall, const std::string &outputfolder) |
|
static void | setPixel (unsigned char *pixel, int wi, int hi, int numColorChannel, int x, int y, unsigned char rgb_color[3]) |
|
void | setVisualizationMarkerArray (const std::vector< ros_visualization_msgs::Marker > &marker_array) |
|
◆ drawLine()
static void drawLine |
( |
unsigned char * |
pixel, |
|
|
int |
wi, |
|
|
int |
hi, |
|
|
int |
numColorChannel, |
|
|
int |
startpoint[2], |
|
|
int |
endpoint[2], |
|
|
float |
color[3] |
|
) |
| |
|
static |
◆ drawText()
static void drawText |
( |
unsigned char * |
pixel, |
|
|
int |
wi, |
|
|
int |
hi, |
|
|
int |
numColorChannel, |
|
|
const std::string & |
text, |
|
|
int |
pos[2], |
|
|
float |
color[3] |
|
) |
| |
|
static |
◆ jpegOutputCallback()
void jpegOutputCallback |
( |
unsigned char |
oneByte | ) |
|
◆ plotPointCloud()
void plotPointCloud |
( |
const ros_sensor_msgs::PointCloud2 & |
cloud_, |
|
|
int |
intervall, |
|
|
const std::string & |
outputfolder |
|
) |
| |
◆ setPixel()
static void setPixel |
( |
unsigned char * |
pixel, |
|
|
int |
wi, |
|
|
int |
hi, |
|
|
int |
numColorChannel, |
|
|
int |
x, |
|
|
int |
y, |
|
|
unsigned char |
rgb_color[3] |
|
) |
| |
|
static |
◆ setVisualizationMarkerArray()
void setVisualizationMarkerArray |
( |
const std::vector< ros_visualization_msgs::Marker > & |
marker_array | ) |
|
◆ foutJpg
◆ s_fontCharBlock8x12
unsigned char s_fontCharBlock8x12[] |
|
static |
◆ s_visualization_marker_array
std::vector<ros_visualization_msgs::Marker> s_visualization_marker_array |
|
static |