#include <ros/ros.h>#include <sensor_msgs/Range.h>#include <std_msgs/Int32.h>#include <string>#include <utility>#include <limits>
Go to the source code of this file.
Defines | |
| #define | VREP_ANGLE_DETECTION 0.5236 |
| #define | VREP_END VREP_UPPER_BOUND - VREP_LOWER_BOUND + 1 |
| #define | VREP_LOWER_BOUND 1 |
| #define | VREP_MAX_DIST_DETECTION 0.0 |
| #define | VREP_MIN_DIST_DETECTION 0.0 |
| #define | VREP_UPPER_BOUND 10 |
Functions | |
| void | bumperSensorData_cb (const ros::Publisher &publisher, std::size_t sensor_n, const std_msgs::Int32::ConstPtr &msg) |
| Callback processing ulrasonic vrep messages. | |
| int | main (int argc, char **argv) |
Variables | |
| std::string | tf_prefix |
| #define VREP_ANGLE_DETECTION 0.5236 |
Definition at line 13 of file bumper.cpp.
| #define VREP_END VREP_UPPER_BOUND - VREP_LOWER_BOUND + 1 |
Definition at line 11 of file bumper.cpp.
| #define VREP_LOWER_BOUND 1 |
Definition at line 9 of file bumper.cpp.
| #define VREP_MAX_DIST_DETECTION 0.0 |
Definition at line 15 of file bumper.cpp.
| #define VREP_MIN_DIST_DETECTION 0.0 |
Definition at line 14 of file bumper.cpp.
| #define VREP_UPPER_BOUND 10 |
Definition at line 10 of file bumper.cpp.
| void bumperSensorData_cb | ( | const ros::Publisher & | publisher, |
| std::size_t | sensor_n, | ||
| const std_msgs::Int32::ConstPtr & | msg | ||
| ) |
Callback processing ulrasonic vrep messages.
Transform vrep bumper message to proper ROS range message
| msg | message from vrep |
| sensor_n | [description] |
| publisher | relevat publisher for this messages |
Definition at line 28 of file bumper.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 51 of file bumper.cpp.
| std::string tf_prefix |
Definition at line 18 of file bumper.cpp.