#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.
| Macros | |
| #define | TIME_STEP 32; | 
| Functions | |
| void | controllerNameCallback (const std_msgs::String::ConstPtr &name) | 
| int | main (int argc, char **argv) | 
| void | quit (int sig) | 
| void | rangeFinderCallback (const sensor_msgs::Image::ConstPtr &image) | 
| Variables | |
| static int | controllerCount | 
| static std::vector< std::string > | controllerList | 
| static std::vector< float > | imageRangeFinder | 
| ros::ServiceClient | timeStepClient | 
| webots_ros::set_int | timeStepSrv | 
| #define TIME_STEP 32; | 
Definition at line 29 of file catch_the_bird.cpp.
| void controllerNameCallback | ( | const std_msgs::String::ConstPtr & | name | ) | 
Definition at line 39 of file catch_the_bird.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 63 of file catch_the_bird.cpp.
| void quit | ( | int | sig | ) | 
Definition at line 55 of file catch_the_bird.cpp.
| void rangeFinderCallback | ( | const sensor_msgs::Image::ConstPtr & | image | ) | 
Definition at line 46 of file catch_the_bird.cpp.
| 
 | static | 
Definition at line 31 of file catch_the_bird.cpp.
| 
 | static | 
Definition at line 32 of file catch_the_bird.cpp.
| 
 | static | 
Definition at line 33 of file catch_the_bird.cpp.
| ros::ServiceClient timeStepClient | 
Definition at line 35 of file catch_the_bird.cpp.
| webots_ros::set_int timeStepSrv | 
Definition at line 36 of file catch_the_bird.cpp.