estimation::OdomEstimationNode Class Reference

#include <odom_estimation_node.h>

List of all members.

Public Member Functions

 OdomEstimationNode ()
 constructor
virtual ~OdomEstimationNode ()
 destructor

Private Member Functions

bool getStatus (robot_pose_ekf::GetStatus::Request &req, robot_pose_ekf::GetStatus::Response &resp)
 get the status of the filter
void imuCallback (const ImuConstPtr &imu)
 callback function for imu data
void odomCallback (const OdomConstPtr &odom)
 callback function for odo data
void spin (const ros::TimerEvent &e)
 the mail filter loop that will be called periodically
void voCallback (const VoConstPtr &vo)
 callback function for vo data

Private Attributes

tf::Transform base_vo_init_
tf::StampedTransform camera_base_
std::ofstream corr_file_
bool debug_
unsigned int ekf_sent_counter_
std::ofstream extra_file_
ros::Time filter_stamp_
bool imu_active_
unsigned int imu_callback_counter_
MatrixWrapper::SymmetricMatrix imu_covariance_
std::ofstream imu_file_
ros::Time imu_init_stamp_
bool imu_initializing_
tf::Transform imu_meas_
ros::Time imu_stamp_
ros::Subscriber imu_sub_
ros::Time imu_time_
bool imu_used_
OdomEstimation my_filter_
ros::NodeHandle node_
bool odom_active_
tf::TransformBroadcaster odom_broadcaster_
unsigned int odom_callback_counter_
MatrixWrapper::SymmetricMatrix odom_covariance_
std::ofstream odom_file_
ros::Time odom_init_stamp_
bool odom_initializing_
tf::Transform odom_meas_
ros::Time odom_stamp_
ros::Subscriber odom_sub_
ros::Time odom_time_
bool odom_used_
geometry_msgs::PoseWithCovarianceStamped output_
std::string output_frame_
ros::Publisher pose_pub_
tf::TransformListener robot_state_
bool self_diagnose_
ros::ServiceServer state_srv_
std::ofstream time_file_
double timeout_
ros::Timer timer_
bool vo_active_
unsigned int vo_callback_counter_
MatrixWrapper::SymmetricMatrix vo_covariance_
std::ofstream vo_file_
ros::Time vo_init_stamp_
bool vo_initializing_
tf::Transform vo_meas_
ros::Time vo_stamp_
ros::Subscriber vo_sub_
ros::Time vo_time_
bool vo_used_

Detailed Description

Definition at line 67 of file odom_estimation_node.h.


Constructor & Destructor Documentation

estimation::OdomEstimationNode::OdomEstimationNode (  ) 

constructor

Definition at line 54 of file odom_estimation_node.cpp.

estimation::OdomEstimationNode::~OdomEstimationNode (  )  [virtual]

destructor

Definition at line 130 of file odom_estimation_node.cpp.


Member Function Documentation

bool estimation::OdomEstimationNode::getStatus ( robot_pose_ekf::GetStatus::Request req,
robot_pose_ekf::GetStatus::Response resp 
) [private]

get the status of the filter

Definition at line 391 of file odom_estimation_node.cpp.

void estimation::OdomEstimationNode::imuCallback ( const ImuConstPtr imu  )  [private]

callback function for imu data

Definition at line 195 of file odom_estimation_node.cpp.

void estimation::OdomEstimationNode::odomCallback ( const OdomConstPtr odom  )  [private]

callback function for odo data

Definition at line 148 of file odom_estimation_node.cpp.

void estimation::OdomEstimationNode::spin ( const ros::TimerEvent &  e  )  [private]

the mail filter loop that will be called periodically

Definition at line 311 of file odom_estimation_node.cpp.

void estimation::OdomEstimationNode::voCallback ( const VoConstPtr vo  )  [private]

callback function for vo data

Definition at line 266 of file odom_estimation_node.cpp.


Member Data Documentation

Definition at line 110 of file odom_estimation_node.h.

tf::StampedTransform estimation::OdomEstimationNode::camera_base_ [private]

Definition at line 111 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 120 of file odom_estimation_node.h.

Definition at line 127 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 113 of file odom_estimation_node.h.

Definition at line 115 of file odom_estimation_node.h.

Definition at line 127 of file odom_estimation_node.h.

MatrixWrapper::SymmetricMatrix estimation::OdomEstimationNode::imu_covariance_ [private]

Definition at line 119 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 114 of file odom_estimation_node.h.

Definition at line 117 of file odom_estimation_node.h.

Definition at line 109 of file odom_estimation_node.h.

Definition at line 113 of file odom_estimation_node.h.

ros::Subscriber estimation::OdomEstimationNode::imu_sub_ [private]

Definition at line 95 of file odom_estimation_node.h.

Definition at line 112 of file odom_estimation_node.h.

Definition at line 116 of file odom_estimation_node.h.

Definition at line 99 of file odom_estimation_node.h.

ros::NodeHandle estimation::OdomEstimationNode::node_ [private]

Definition at line 92 of file odom_estimation_node.h.

Definition at line 115 of file odom_estimation_node.h.

tf::TransformBroadcaster estimation::OdomEstimationNode::odom_broadcaster_ [private]

Definition at line 106 of file odom_estimation_node.h.

Definition at line 127 of file odom_estimation_node.h.

MatrixWrapper::SymmetricMatrix estimation::OdomEstimationNode::odom_covariance_ [private]

Definition at line 119 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 114 of file odom_estimation_node.h.

Definition at line 117 of file odom_estimation_node.h.

Definition at line 109 of file odom_estimation_node.h.

Definition at line 113 of file odom_estimation_node.h.

ros::Subscriber estimation::OdomEstimationNode::odom_sub_ [private]

Definition at line 95 of file odom_estimation_node.h.

Definition at line 112 of file odom_estimation_node.h.

Definition at line 116 of file odom_estimation_node.h.

geometry_msgs::PoseWithCovarianceStamped estimation::OdomEstimationNode::output_ [private]

Definition at line 102 of file odom_estimation_node.h.

Definition at line 121 of file odom_estimation_node.h.

Definition at line 94 of file odom_estimation_node.h.

tf::TransformListener estimation::OdomEstimationNode::robot_state_ [private]

Definition at line 105 of file odom_estimation_node.h.

Definition at line 120 of file odom_estimation_node.h.

ros::ServiceServer estimation::OdomEstimationNode::state_srv_ [private]

Definition at line 96 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 118 of file odom_estimation_node.h.

Definition at line 93 of file odom_estimation_node.h.

Definition at line 115 of file odom_estimation_node.h.

Definition at line 127 of file odom_estimation_node.h.

MatrixWrapper::SymmetricMatrix estimation::OdomEstimationNode::vo_covariance_ [private]

Definition at line 119 of file odom_estimation_node.h.

Definition at line 124 of file odom_estimation_node.h.

Definition at line 114 of file odom_estimation_node.h.

Definition at line 117 of file odom_estimation_node.h.

Definition at line 109 of file odom_estimation_node.h.

Definition at line 113 of file odom_estimation_node.h.

ros::Subscriber estimation::OdomEstimationNode::vo_sub_ [private]

Definition at line 95 of file odom_estimation_node.h.

Definition at line 112 of file odom_estimation_node.h.

Definition at line 116 of file odom_estimation_node.h.


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


robot_pose_ekf
Author(s): Wim Meeussen
autogenerated on Fri Jan 11 10:07:53 2013