#include <ros/ros.h>#include "ros/time.h"#include "ros/console.h"#include "ros/assert.h"#include "ros/common.h"#include "ros/types.h"#include "ros/node_handle.h"#include "ros/publisher.h"#include "ros/forwards.h"#include "ros/message.h"#include "ros/serialization.h"#include <boost/utility.hpp>#include "ros/service_server.h"#include "ros/subscriber.h"#include <string>#include "ros/service_traits.h"#include "forwards.h"#include <boost/shared_ptr.hpp>#include "ros/init.h"#include "XmlRpcValue.h"#include "node_handle.h"#include "ros/names.h"#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <boost/noncopyable.hpp>#include <boost/function.hpp>#include <stdexcept>#include "image_transport/exception.h"#include "image_transport/loader_fwds.h"#include <vector>#include <ostream>#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "std_msgs/Header.h"#include "image_transport/single_subscriber_publisher.h"#include <sensor_msgs/CameraInfo.h>#include "image_transport/transport_hints.h"#include "opencv2/core/core_c.h"#include "opencv2/core/core.hpp"#include "opencv/cv.h"#include <opencv/highgui.h>#include <fstream>#include <dirent.h>#include <fnmatch.h>#include <cstdio>

Go to the source code of this file.
Functions | |
| int | getidir (struct dirent const *entry) |
| int | getleft (struct dirent const *entry) |
| int | getright (struct dirent const *entry) |
| int | main (int argc, char **argv) |
Variables | |
| char * | dreg |
| char * | lreg |
| char * | rreg |
| int getidir | ( | struct dirent const * | entry | ) |
Definition at line 29 of file fake_stereo_cam.cpp.
| int getleft | ( | struct dirent const * | entry | ) |
Definition at line 14 of file fake_stereo_cam.cpp.
| int getright | ( | struct dirent const * | entry | ) |
Definition at line 21 of file fake_stereo_cam.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 36 of file fake_stereo_cam.cpp.
| char * dreg |
Definition at line 11 of file fake_stereo_cam.cpp.
| char* lreg |
Definition at line 11 of file fake_stereo_cam.cpp.
| char * rreg |
Definition at line 11 of file fake_stereo_cam.cpp.