#include <signal.h>#include "ros/ros.h"#include <webots_ros/robot_get_device_list.h>#include <webots_ros/get_int.h>#include <webots_ros/get_string.h>#include <std_msgs/String.h>
Go to the source code of this file.
Macros | |
| #define | TIME_STEP 32 |
Functions | |
| void | controllerNameCallback (const std_msgs::String::ConstPtr &name) |
| int | main (int argc, char **argv) |
| void | quit (int sig) |
Variables | |
| static int | controllerCount |
| static std::vector< std::string > | controllerList |
| #define TIME_STEP 32 |
Definition at line 31 of file robot_information_parser.cpp.
| void controllerNameCallback | ( | const std_msgs::String::ConstPtr & | name | ) |
Definition at line 37 of file robot_information_parser.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 49 of file robot_information_parser.cpp.
| void quit | ( | int | sig | ) |
Definition at line 43 of file robot_information_parser.cpp.
|
static |
Definition at line 33 of file robot_information_parser.cpp.
|
static |
Definition at line 34 of file robot_information_parser.cpp.