#include <iostream>
#include <cstdlib>
#include <cstdio>
#include <vector>
#include "pyra/tpimageutil.h"
#include "fgbgsegment.h"
#include "timercpu.h"
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <stereo_msgs/DisparityImage.h>
Go to the source code of this file.
Classes | |
class | ActiveRealTimeSegmenter |
ROS Node class. More... | |
Functions | |
int | main (int argc, char **argv) |
Image IO with ROS topics and execution of segmentation of data. NOTE: PR2 got only monochrome narrow stereo images, RGB images therefore with gray level info on every channel
Definition in file dosegment_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 178 of file dosegment_node.cpp.