Functions | Variables
visualize_patches.cpp File Reference
#include <ros/ros.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <vector>
#include <math.h>
#include <proximity_sensor_driver/prox_sensor_measurement.h>
Include dependency graph for visualize_patches.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
void proxSensorDataCallback (const boost::shared_ptr< proximity_sensor_driver::prox_sensor_measurement const > &msg)
template<class T >
void readParam (const ros::NodeHandle &nh, const std::string &str_name, T &rhs)

Variables

int sensor_count = 0
vector< int > sensor_measurements

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 75 of file visualize_patches.cpp.

void proxSensorDataCallback ( const boost::shared_ptr< proximity_sensor_driver::prox_sensor_measurement const > &  msg)

Definition at line 53 of file visualize_patches.cpp.

template<class T >
void readParam ( const ros::NodeHandle nh,
const std::string &  str_name,
T &  rhs 
) [inline]

Definition at line 64 of file visualize_patches.cpp.


Variable Documentation

int sensor_count = 0

Definition at line 49 of file visualize_patches.cpp.

vector<int> sensor_measurements

Definition at line 50 of file visualize_patches.cpp.



proximity_sensor_visualize
Author(s): Adrian Funk (Maintained by Philip Roan)
autogenerated on Fri Jan 3 2014 11:09:01