Functions | Variables
stub.cpp File Reference
#include <ros/ros.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/Image.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <tf/transform_datatypes.h>
#include <articulation_msgs/TrackMsg.h>
Include dependency graph for stub.cpp:

Go to the source code of this file.

Functions

void imageCallback (const sensor_msgs::Image::ConstPtr &msg)
void infoCallback (const sensor_msgs::CameraInfo::ConstPtr &msg)
int main (int argc, char **argv)
cv::Point to2D (cv::Point3f pt)
cv::Point3f to3D (cv::Point a)

Variables

sensor_msgs::CameraInfo::ConstPtr cameraInfo_
cv_bridge::CvImagePtr cv_ptr
cv::Mat debugImage_

Function Documentation

void imageCallback ( const sensor_msgs::Image::ConstPtr &  msg)

Definition at line 51 of file stub.cpp.

void infoCallback ( const sensor_msgs::CameraInfo::ConstPtr &  msg)

Definition at line 46 of file stub.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 72 of file stub.cpp.

cv::Point to2D ( cv::Point3f  pt) [inline]

Definition at line 38 of file stub.cpp.

cv::Point3f to3D ( cv::Point  a) [inline]

Definition at line 26 of file stub.cpp.


Variable Documentation

sensor_msgs::CameraInfo::ConstPtr cameraInfo_

Definition at line 21 of file stub.cpp.

cv_bridge::CvImagePtr cv_ptr

Definition at line 22 of file stub.cpp.

cv::Mat debugImage_

Definition at line 23 of file stub.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


articulation_perception
Author(s):
autogenerated on Wed Dec 26 2012 16:41:22