Macros | Functions | Variables
sr_bumper_rviz_marker.cpp File Reference

See README. More...

#include <ros/ros.h>
#include <visualization_msgs/Marker.h>
#include <gazebo_msgs/ContactsState.h>
#include <string>
#include <vector>
#include <boost/thread/mutex.hpp>
#include <std_msgs/Float64.h>
Include dependency graph for sr_bumper_rviz_marker.cpp:

Go to the source code of this file.

Macros

#define COUNTDOWN_MAX   5
 
#define FF   0
 
#define LF   3
 
#define MF   1
 
#define RF   2
 
#define TH   4
 

Functions

void callback_ff (const gazebo_msgs::ContactsState &msg)
 
void callback_lf (const gazebo_msgs::ContactsState &msg)
 
void callback_mf (const gazebo_msgs::ContactsState &msg)
 
void callback_rf (const gazebo_msgs::ContactsState &msg)
 
void callback_th (const gazebo_msgs::ContactsState &msg)
 
int main (int argc, char **argv)
 
void publish_marker (unsigned int id, std::string framesuffix, float force)
 
void publish_marker_special (unsigned int id, std::string framesuffix, const ::geometry_msgs::Vector3 &force, int col)
 

Variables

int colors [8][3]
 
int countdown [5] = {COUNTDOWN_MAX, COUNTDOWN_MAX, COUNTDOWN_MAX, COUNTDOWN_MAX, COUNTDOWN_MAX}
 
std_msgs::Float64::_data_type data [5]
 
ros::Publisher marker_pub
 
uint32_t shape = visualization_msgs::Marker::ARROW
 
ros::Subscriber sub [5]
 
boost::mutex update_mutex
 

Detailed Description

See README.

Author
Ugo Cupcic ugo@s.nosp@m.hado.nosp@m.wrobo.nosp@m.t.co.nosp@m.m

Definition in file sr_bumper_rviz_marker.cpp.

Macro Definition Documentation

◆ COUNTDOWN_MAX

#define COUNTDOWN_MAX   5

Definition at line 37 of file sr_bumper_rviz_marker.cpp.

◆ FF

#define FF   0

Definition at line 38 of file sr_bumper_rviz_marker.cpp.

◆ LF

#define LF   3

Definition at line 41 of file sr_bumper_rviz_marker.cpp.

◆ MF

#define MF   1

Definition at line 39 of file sr_bumper_rviz_marker.cpp.

◆ RF

#define RF   2

Definition at line 40 of file sr_bumper_rviz_marker.cpp.

◆ TH

#define TH   4

Definition at line 42 of file sr_bumper_rviz_marker.cpp.

Function Documentation

◆ callback_ff()

void callback_ff ( const gazebo_msgs::ContactsState &  msg)

Definition at line 165 of file sr_bumper_rviz_marker.cpp.

◆ callback_lf()

void callback_lf ( const gazebo_msgs::ContactsState &  msg)

Definition at line 219 of file sr_bumper_rviz_marker.cpp.

◆ callback_mf()

void callback_mf ( const gazebo_msgs::ContactsState &  msg)

Definition at line 183 of file sr_bumper_rviz_marker.cpp.

◆ callback_rf()

void callback_rf ( const gazebo_msgs::ContactsState &  msg)

Definition at line 201 of file sr_bumper_rviz_marker.cpp.

◆ callback_th()

void callback_th ( const gazebo_msgs::ContactsState &  msg)

Definition at line 237 of file sr_bumper_rviz_marker.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 256 of file sr_bumper_rviz_marker.cpp.

◆ publish_marker()

void publish_marker ( unsigned int  id,
std::string  framesuffix,
float  force 
)

Definition at line 112 of file sr_bumper_rviz_marker.cpp.

◆ publish_marker_special()

void publish_marker_special ( unsigned int  id,
std::string  framesuffix,
const ::geometry_msgs::Vector3 &  force,
int  col 
)

Definition at line 61 of file sr_bumper_rviz_marker.cpp.

Variable Documentation

◆ colors

int colors[8][3]
Initial value:
= {{0, 0, 0},
{1, 0, 0},
{0, 1, 0},
{0, 0, 1},
{1, 1, 0},
{1, 0, 1},
{0, 1, 1},
{1, 1, 1}}

Definition at line 49 of file sr_bumper_rviz_marker.cpp.

◆ countdown

Definition at line 59 of file sr_bumper_rviz_marker.cpp.

◆ data

std_msgs::Float64::_data_type data[5]

Definition at line 47 of file sr_bumper_rviz_marker.cpp.

◆ marker_pub

ros::Publisher marker_pub

Definition at line 46 of file sr_bumper_rviz_marker.cpp.

◆ shape

uint32_t shape = visualization_msgs::Marker::ARROW

Definition at line 58 of file sr_bumper_rviz_marker.cpp.

◆ sub

Definition at line 45 of file sr_bumper_rviz_marker.cpp.

◆ update_mutex

boost::mutex update_mutex

Definition at line 48 of file sr_bumper_rviz_marker.cpp.



sr_tactile_sensors
Author(s): Ugo Cupcic
autogenerated on Mon Feb 28 2022 23:52:14