#include <algorithm>#include <vector>#include <ros/ros.h>#include <osrf_gear/Goal.h>#include <osrf_gear/LogicalCameraImage.h>#include <osrf_gear/Proximity.h>#include <sensor_msgs/JointState.h>#include <sensor_msgs/LaserScan.h>#include <std_msgs/Float32.h>#include <std_msgs/String.h>#include <std_srvs/Trigger.h>#include <trajectory_msgs/JointTrajectory.h>
Go to the source code of this file.
Classes | |
| class | MyCompetitionClass |
| Example class that can hold state and provide methods that handle incoming data. More... | |
Functions | |
| void | laser_profiler_callback (const sensor_msgs::LaserScan::ConstPtr &msg) |
| int | main (int argc, char **argv) |
| void | proximity_sensor_callback (const osrf_gear::Proximity::ConstPtr &msg) |
| void | start_competition (ros::NodeHandle &node) |
| Start the competition by waiting for and then calling the start ROS Service. More... | |
| void laser_profiler_callback | ( | const sensor_msgs::LaserScan::ConstPtr & | msg | ) |
Definition at line 160 of file gear_example_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 169 of file gear_example_node.cpp.
| void proximity_sensor_callback | ( | const osrf_gear::Proximity::ConstPtr & | msg | ) |
Definition at line 154 of file gear_example_node.cpp.
| void start_competition | ( | ros::NodeHandle & | node | ) |
Start the competition by waiting for and then calling the start ROS Service.
Definition at line 35 of file gear_example_node.cpp.