Defines | Functions | Variables
bumper.cpp File Reference
#include <ros/ros.h>
#include <sensor_msgs/Range.h>
#include <std_msgs/Int32.h>
#include <string>
#include <utility>
#include <limits>
Include dependency graph for bumper.cpp:

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 Documentation

#define VREP_ANGLE_DETECTION   0.5236

Definition at line 13 of file bumper.cpp.

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.


Function Documentation

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

Parameters:
msgmessage from vrep
sensor_n[description]
publisherrelevat 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.


Variable Documentation

std::string tf_prefix

Definition at line 18 of file bumper.cpp.



p3dx_hal_vrep
Author(s):
autogenerated on Sat Jun 8 2019 20:22:32