All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines
Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes
vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT > Class Template Reference

The class that interfaces visual odometry with ROS. More...

List of all members.

Public Member Functions

 VORosInterface (ros::NodeHandle &_nhandle, ros::NodeHandle &_nhandle_priv, shared_ptr< VOType > _vo)

Protected Types

typedef VisualOdometryTT
< NodeBuilderTT, PoseGraphT > 
VOType
 Object type satisfiying VisualOdometry interface.

Protected Member Functions

void chatterCallback (const sensor_msgs::ImageConstPtr &it_image)
 Callback for panorama image messages (1600x800). Invokes the VO processPose which all the work.
void confirmResolutionOrExit (const cv::Mat &image)
 call ros::shutdown() iff resolution of input images is not acceptable.
int seqFromTimestamp (ros::Time t)
 Produces integer identifier for given timestamp.

Protected Attributes

image_transport::ImageTransport it
tf::TransformListener listener
 Not used.
ros::NodeHandle & nhandle
ros::NodeHandle & nhandle_priv
ros::Publisher odometry_pub
image_transport::Subscriber sub
shared_ptr< VOTypevo

Detailed Description

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
class vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >

The class that interfaces visual odometry with ROS.

Template Parameters:
VisualOdometryTTClass template where the class filfills VisualOdometry inteface.
NodeBuilderTTType satisfying OneDetectorNodeBuilder interface.
PoseGraphTboost::adjacency_list type.

Definition at line 88 of file pe.cpp.


Member Typedef Documentation

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
typedef VisualOdometryTT<NodeBuilderTT, PoseGraphT> vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::VOType [protected]

Object type satisfiying VisualOdometry interface.

Definition at line 91 of file pe.cpp.


Constructor & Destructor Documentation

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::VORosInterface ( ros::NodeHandle &  _nhandle,
ros::NodeHandle &  _nhandle_priv,
shared_ptr< VOType _vo 
) [inline]
Parameters:
_voinstantiated class of type which fullfills VisualOdometry interface.

the following code may be usefel in the future:

            ros::Time now = ros::Time::now();
            listener.waitForTransform("/base_footprint", "/omnicam", now, ros::Duration(3.0));

Definition at line 106 of file pe.cpp.


Member Function Documentation

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
void vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::chatterCallback ( const sensor_msgs::ImageConstPtr &  it_image) [inline, protected]

Callback for panorama image messages (1600x800). Invokes the VO processPose which all the work.

See also:
VisualOdometry::processPose

Definition at line 152 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
void vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::confirmResolutionOrExit ( const cv::Mat &  image) [inline, protected]

call ros::shutdown() iff resolution of input images is not acceptable.

Definition at line 136 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
int vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::seqFromTimestamp ( ros::Time  t) [inline, protected]

Produces integer identifier for given timestamp.

Definition at line 127 of file pe.cpp.


Member Data Documentation

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
image_transport::ImageTransport vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::it [protected]

Definition at line 95 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
tf::TransformListener vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::listener [protected]

Not used.

Definition at line 99 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
ros::NodeHandle& vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::nhandle [protected]

Definition at line 93 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
ros::NodeHandle& vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::nhandle_priv [protected]

Definition at line 94 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
ros::Publisher vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::odometry_pub [protected]

Definition at line 100 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
image_transport::Subscriber vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::sub [protected]

Definition at line 98 of file pe.cpp.

template<template< template< class > class, class > class VisualOdometryTT, template< class > class NodeBuilderTT, class PoseGraphT>
shared_ptr<VOType> vslam::VORosInterface< VisualOdometryTT, NodeBuilderTT, PoseGraphT >::vo [protected]

Definition at line 96 of file pe.cpp.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


pose_estimation
Author(s): Jiri Divis/jiridivis@gmail.com
autogenerated on Wed Mar 27 2013 21:00:17