#include <ros/ros.h>#include <visualization_msgs/Marker.h>#include <std_msgs/ColorRGBA.h>#include <lse_sensor_msgs/Nostril.h>#include <lse_sensor_msgs/TPA.h>
Go to the source code of this file.
Defines | |
| #define | NODE_VERSION 0.2 |
| #define | PIXEL_TO_M 20.0 |
Functions | |
| std::string | char2string (char *in) |
| void | configColorBar (ros::NodeHandle *pn, visualization_msgs::Marker *ptrMarker) |
| std_msgs::ColorRGBA | hsv_2_rgb (float H, float S, float V) |
| Convertion function between the HSV and the RGB space colors. | |
| int | main (int argc, char **argv) |
| void | makeColorBar (visualization_msgs::Marker *ptrMarker, int val) |
| Make the color bar with the markers according to the specified values. | |
| void | noseCallback (const lse_sensor_msgs::NostrilConstPtr &msg) |
Variables | |
| double | hsvS = 1.0 |
| HSV components. | |
| double | hsvV = 1.0 |
| int | hueMax = 200 |
| int | hueMin = 0 |
| lse_sensor_msgs::Nostril | myNostril |
| nose data | |
| lse_sensor_msgs::Nostril | myNostril_0 |
| lse_sensor_msgs::Nostril | myNostril_1 |
| bool | verbose = true |
| flag for verbose mode | |
| #define NODE_VERSION 0.2 |
Definition at line 43 of file odor_bar.cpp.
| #define PIXEL_TO_M 20.0 |
Definition at line 45 of file odor_bar.cpp.
| std::string char2string | ( | char * | in | ) |
Definition at line 86 of file odor_bar.cpp.
| void configColorBar | ( | ros::NodeHandle * | pn, |
| visualization_msgs::Marker * | ptrMarker | ||
| ) |
Definition at line 252 of file odor_bar.cpp.
| std_msgs::ColorRGBA hsv_2_rgb | ( | float | H, |
| float | S, | ||
| float | V | ||
| ) |
Convertion function between the HSV and the RGB space colors.
| H | the Hue component of HSV. |
| S | the Saturation component of HSV |
| V | the Value component of HSV |
Definition at line 103 of file odor_bar.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 270 of file odor_bar.cpp.
| void makeColorBar | ( | visualization_msgs::Marker * | ptrMarker, |
| int | val | ||
| ) |
Make the color bar with the markers according to the specified values.
| ptrMarker | a pointer to the marker object. |
| val | the actual value to be inserted in the bar. |
Definition at line 209 of file odor_bar.cpp.
| void noseCallback | ( | const lse_sensor_msgs::NostrilConstPtr & | msg | ) |
Definition at line 61 of file odor_bar.cpp.
| double hsvS = 1.0 |
HSV components.
Definition at line 53 of file odor_bar.cpp.
| double hsvV = 1.0 |
Definition at line 53 of file odor_bar.cpp.
| int hueMax = 200 |
Definition at line 54 of file odor_bar.cpp.
| int hueMin = 0 |
Definition at line 54 of file odor_bar.cpp.
nose data
Definition at line 58 of file odor_bar.cpp.
Definition at line 58 of file odor_bar.cpp.
Definition at line 58 of file odor_bar.cpp.
| bool verbose = true |
flag for verbose mode
Definition at line 49 of file odor_bar.cpp.