#include <ros/ros.h>
#include <cop_client_cpp/cop_client.h>
#include <std_msgs/String.h>
#include <sstream>
Go to the source code of this file.
Functions | |
void | cb_logging (const std_msgs::StringConstPtr &str) |
int | main (int argc, char *argv[]) |
Variables | |
std::map< long, std::string > | mapping |
ros::Subscriber | sr |
void cb_logging | ( | const std_msgs::StringConstPtr & | str | ) |
Definition at line 39 of file refinements.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 48 of file refinements.cpp.
std::map<long, std::string> mapping |
Definition at line 37 of file refinements.cpp.
Definition at line 35 of file refinements.cpp.