#include "ros/ros.h"#include <image_transport/image_transport.h>#include <dynamic_reconfigure/server.h>#include <optris_drivers/ThresholdConfig.h>#include "libirimager/ImageBuilder.h"
Go to the source code of this file.
Functions | |
| void | callback (optris_drivers::ThresholdConfig &config, uint32_t level) |
| int | main (int argc, char *argv[]) |
| void | onThermalDataReceive (const sensor_msgs::ImageConstPtr &image) |
Variables | |
| bool | _invert = false |
| image_transport::Publisher * | _pubThermal |
| double | _threshold = 40.0 |
| void callback | ( | optris_drivers::ThresholdConfig & | config, |
| uint32_t | level | ||
| ) |
Callback function for dynamic reconfigure package
| config | configuration |
| level | level of configuration |
Definition at line 98 of file optris_binary_image_node.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Main routine of optris_binary_image_node.cpp
| argc | |
| argv |
Usage: rosrun optris_drivers optris_binary_image_node _threshold=20 _invert:=false
Definition at line 114 of file optris_binary_image_node.cpp.
| void onThermalDataReceive | ( | const sensor_msgs::ImageConstPtr & | image | ) |
Callback function for receiving thermal data from thermal imager node
| image | image containing raw temperature data |
Definition at line 57 of file optris_binary_image_node.cpp.
| bool _invert = false |
Definition at line 50 of file optris_binary_image_node.cpp.
| image_transport::Publisher* _pubThermal |
Definition at line 47 of file optris_binary_image_node.cpp.
| double _threshold = 40.0 |
Definition at line 49 of file optris_binary_image_node.cpp.