#include <signal.h>
#include "ros/ros.h"
#include "tf/tf.h"
#include <webots_ros/get_bool.h>
#include <webots_ros/get_int.h>
#include <webots_ros/get_uint64.h>
#include <webots_ros/set_int.h>
#include <webots_ros/field_get_node.h>
#include <webots_ros/field_get_rotation.h>
#include <webots_ros/field_get_name.h>
#include <webots_ros/field_get_vec3f.h>
#include <webots_ros/field_set_rotation.h>
#include <webots_ros/field_set_vec3f.h>
#include <webots_ros/node_get_field.h>
#include <webots_ros/supervisor_movie_start_recording.h>
#include <webots_ros/supervisor_set_label.h>
#include <std_msgs/String.h>
Go to the source code of this file.
◆ TIME_STEP
◆ controllerNameCallback()
void controllerNameCallback |
( |
const std_msgs::String::ConstPtr & |
name | ) |
|
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ quit()
◆ controllerCount
◆ controllerList
◆ timeStepClient
◆ timeStepSrv
webots_ros::set_int timeStepSrv |