#include <algorithm>
#include <stdio.h>
#include <stdlib.h>
#include <string.h>
#include <iostream>
#include <sys/wait.h>
#include <unistd.h>
#include <cstdio>
#include <cstdlib>
#include "sick_scan/sick_generic_laser.h"
#include <ros/console.h>
#include "tinystr.h"
#include "tinyxml.h"
Go to the source code of this file.
Classes | |
class | paramEntryAscii |
Macros | |
#define | MAX_NAME_LEN (1024) |
#define | SICK_SCAN_TEST_MAJOR_VER "001" |
#define | SICK_SCAN_TEST_MINOR_VER "000" |
#define | SICK_SCAN_TEST_PATCH_LEVEL "000" |
#define | WIN32_LEAN_AND_MEAN |
Functions | |
void | cloud_callback (const sensor_msgs::PointCloud2ConstPtr &cloud_msg) |
void | createPrefixFromExeName (std::string exeName, std::string &prefix) |
int | createTestLaunchFile (std::string launchFileFullName, std::vector< paramEntryAscii > entryList, std::string &testLaunchFile) |
bool | getPackageRootFolder (std::string exePath, std::string &packageRootFolder) |
std::vector< paramEntryAscii > | getParamList (TiXmlNode *paramList) |
pid_t | launchRosFile (std::string cmdLine) |
int | main (int argc, char **argv) |
Startup routine. More... | |
void | processLaserScan (const sensor_msgs::LaserScan::ConstPtr &scan) |
void | replaceParamList (TiXmlNode *node, std::vector< paramEntryAscii > paramOrgList) |
void | searchForXmlFileInPathList (std::string pathList, std::string &packagePath, std::string xmlFileName) |
int | startCallbackTest (int argc, char **argv) |
void | sudokill (pid_t tokill) |
Variables | |
int | callbackCnt = 0 |
int | callbackScanCnt = 0 |
int | cloud_height = 0 |
int | cloud_width = 0 |
float | ERR_CONST = -1E3 |
double | intensityStdDev = 0.0 |
pid_t | pid |
float | range_max = -1E3 |
float | range_min = -1E3 |
double | rangeStdDev = 0.0 |
float | scan_angle_increment = -1E3 |
float | scan_angle_max = -1E3 |
float | scan_angle_min = -1E3 |
float | scan_time_increment = -1E3 |
#define MAX_NAME_LEN (1024) |
Definition at line 89 of file sick_scan_test.cpp.
#define SICK_SCAN_TEST_MAJOR_VER "001" |
Definition at line 92 of file sick_scan_test.cpp.
#define SICK_SCAN_TEST_MINOR_VER "000" |
Definition at line 93 of file sick_scan_test.cpp.
#define SICK_SCAN_TEST_PATCH_LEVEL "000" |
Definition at line 94 of file sick_scan_test.cpp.
#define WIN32_LEAN_AND_MEAN |
Definition at line 58 of file sick_scan_test.cpp.
void cloud_callback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud_msg | ) |
Definition at line 426 of file sick_scan_test.cpp.
void createPrefixFromExeName | ( | std::string | exeName, |
std::string & | prefix | ||
) |
Definition at line 572 of file sick_scan_test.cpp.
int createTestLaunchFile | ( | std::string | launchFileFullName, |
std::vector< paramEntryAscii > | entryList, | ||
std::string & | testLaunchFile | ||
) |
Definition at line 364 of file sick_scan_test.cpp.
bool getPackageRootFolder | ( | std::string | exePath, |
std::string & | packageRootFolder | ||
) |
Definition at line 619 of file sick_scan_test.cpp.
std::vector<paramEntryAscii> getParamList | ( | TiXmlNode * | paramList | ) |
Definition at line 206 of file sick_scan_test.cpp.
pid_t launchRosFile | ( | std::string | cmdLine | ) |
Definition at line 323 of file sick_scan_test.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Startup routine.
argc | Number of Arguments |
argv | Argument variable |
Definition at line 656 of file sick_scan_test.cpp.
void processLaserScan | ( | const sensor_msgs::LaserScan::ConstPtr & | scan | ) |
Definition at line 532 of file sick_scan_test.cpp.
void replaceParamList | ( | TiXmlNode * | node, |
std::vector< paramEntryAscii > | paramOrgList | ||
) |
Definition at line 296 of file sick_scan_test.cpp.
void searchForXmlFileInPathList | ( | std::string | pathList, |
std::string & | packagePath, | ||
std::string | xmlFileName | ||
) |
Definition at line 595 of file sick_scan_test.cpp.
int startCallbackTest | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 547 of file sick_scan_test.cpp.
void sudokill | ( | pid_t | tokill | ) |
Definition at line 198 of file sick_scan_test.cpp.
int callbackCnt = 0 |
Definition at line 417 of file sick_scan_test.cpp.
int callbackScanCnt = 0 |
Definition at line 423 of file sick_scan_test.cpp.
int cloud_height = 0 |
Definition at line 416 of file sick_scan_test.cpp.
int cloud_width = 0 |
Definition at line 415 of file sick_scan_test.cpp.
float ERR_CONST = -1E3 |
Definition at line 523 of file sick_scan_test.cpp.
double intensityStdDev = 0.0 |
Definition at line 418 of file sick_scan_test.cpp.
pid_t pid |
Definition at line 321 of file sick_scan_test.cpp.
float range_max = -1E3 |
Definition at line 529 of file sick_scan_test.cpp.
float range_min = -1E3 |
Definition at line 528 of file sick_scan_test.cpp.
double rangeStdDev = 0.0 |
Definition at line 419 of file sick_scan_test.cpp.
float scan_angle_increment = -1E3 |
Definition at line 527 of file sick_scan_test.cpp.
float scan_angle_max = -1E3 |
Definition at line 525 of file sick_scan_test.cpp.
float scan_angle_min = -1E3 |
Definition at line 524 of file sick_scan_test.cpp.
float scan_time_increment = -1E3 |
Definition at line 526 of file sick_scan_test.cpp.