#include <signal.h>
#include "ros/ros.h"
#include <sensor_msgs/Image.h>
#include <std_msgs/String.h>
#include <webots_ros/get_float.h>
#include <webots_ros/set_float.h>
#include <webots_ros/set_int.h>
#include <webots_ros/range_finder_get_info.h>
#include <webots_ros/robot_get_device_list.h>
#include <webots_ros/save_image.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()
◆ rangeFinderCallback()
| void rangeFinderCallback |
( |
const sensor_msgs::Image::ConstPtr & |
image | ) |
|
◆ controllerCount
◆ controllerList
| std::vector<std::string> controllerList |
|
static |
◆ imageRangeFinder
| std::vector<float> imageRangeFinder |
|
static |
◆ timeStepClient
◆ timeStepSrv
| webots_ros::set_int timeStepSrv |