#include <ros/ros.h>
#include <std_msgs/String.h>
#include <librealsense/rs.hpp>
#include <librealsense/rs.h>
#include <string>
#include <sstream>
#include <ros/package.h>
#include <sys/utsname.h>
#include <cstdlib>
#include <stdlib.h>
#include <array>
Go to the source code of this file.
Functions | |
std::string | getSystemCallOutput (const char *cmd) |
int | main (int argc, char **argv) |
Variables | |
rs_context * | rs_context_ = NULL |
rs_error * | rs_error_ = NULL |
std::string getSystemCallOutput | ( | const char * | cmd | ) |
Definition at line 46 of file get_debug_info.cpp.
Definition at line 73 of file get_debug_info.cpp.
rs_context* rs_context_ = NULL |
Definition at line 43 of file get_debug_info.cpp.
Definition at line 44 of file get_debug_info.cpp.