All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends
Public Types | Public Member Functions | Static Public Member Functions | Protected Types | Protected Attributes | Private Attributes
hector_pose_estimation::PoseEstimation Class Reference

#include <pose_estimation.h>

List of all members.

Public Types

typedef boost::function< bool(SystemStatus &)> SystemStatusCallback

Public Member Functions

virtual const MeasurementPtraddMeasurement (const MeasurementPtr &measurement)
virtual const MeasurementPtraddMeasurement (Measurement *measurement)
virtual const MeasurementPtraddMeasurement (const std::string &name, const MeasurementPtr &measurement)
template<class ConcreteMeasurementModel >
const MeasurementPtraddMeasurement (const std::string &name, ConcreteMeasurementModel *model)
virtual void cleanup ()
virtual BFL::KalmanFilter * filter ()
virtual const BFL::KalmanFilter * filter () const
virtual void getBias (tf::Vector3 &angular_velocity, tf::Vector3 &linear_acceleration)
virtual void getBias (tf::Stamped< tf::Vector3 > &angular_velocity, tf::Stamped< tf::Vector3 > &linear_acceleration)
virtual void getBias (geometry_msgs::Vector3 &angular_velocity, geometry_msgs::Vector3 &linear_acceleration)
virtual void getBias (geometry_msgs::Vector3Stamped &angular_velocity, geometry_msgs::Vector3Stamped &linear_acceleration)
virtual const StateCovariancegetCovariance ()
virtual void getGlobalPosition (double &latitude, double &longitude, double &altitude)
virtual void getGlobalPosition (sensor_msgs::NavSatFix &global)
virtual void getHeader (std_msgs::Header &header)
virtual void getImuWithBiases (geometry_msgs::Vector3 &linear_acceleration, geometry_msgs::Vector3 &angular_velocity)
virtual MeasurementPtr getMeasurement (const std::string &name) const
virtual SystemStatus getMeasurementStatus () const
virtual void getOrientation (tf::Quaternion &quaternion)
virtual void getOrientation (tf::Stamped< tf::Quaternion > &quaternion)
virtual void getOrientation (geometry_msgs::Quaternion &pose)
virtual void getOrientation (geometry_msgs::QuaternionStamped &pose)
virtual void getOrientation (double &yaw, double &pitch, double &roll)
virtual ParameterList getParameters () const
virtual void getPose (tf::Pose &pose)
virtual void getPose (tf::Stamped< tf::Pose > &pose)
virtual void getPose (geometry_msgs::Pose &pose)
virtual void getPose (geometry_msgs::PoseStamped &pose)
virtual void getPosition (tf::Point &point)
virtual void getPosition (tf::Stamped< tf::Point > &point)
virtual void getPosition (geometry_msgs::Point &pose)
virtual void getPosition (geometry_msgs::PointStamped &pose)
virtual void getRate (tf::Vector3 &vector)
virtual void getRate (tf::Stamped< tf::Vector3 > &vector)
virtual void getRate (geometry_msgs::Vector3 &vector)
virtual void getRate (geometry_msgs::Vector3Stamped &vector)
virtual const StateVectorgetState ()
virtual void getState (nav_msgs::Odometry &state, bool with_covariances=true)
virtual const SystemPtrgetSystem () const
virtual const SystemModelgetSystemModel () const
virtual SystemStatus getSystemStatus () const
virtual ros::Time getTimestamp () const
virtual void getTransforms (std::vector< tf::StampedTransform > &transforms)
virtual void getVelocity (tf::Vector3 &vector)
virtual void getVelocity (tf::Stamped< tf::Vector3 > &vector)
virtual void getVelocity (geometry_msgs::Vector3 &vector)
virtual void getVelocity (geometry_msgs::Vector3Stamped &vector)
virtual GlobalReferenceglobalReference ()
virtual bool init ()
virtual bool inSystemStatus (SystemStatus test_status) const
virtual ParameterListparameters ()
virtual const ParameterListparameters () const
 PoseEstimation (const SystemPtr &system=SystemPtr())
template<typename ConcreteSystemModel >
 PoseEstimation (ConcreteSystemModel *system_model)
virtual void reset ()
virtual void setCovariance (const StateCovariance &covariance)
virtual bool setMeasurementStatus (SystemStatus new_status)
virtual void setState (const StateVector &state)
virtual const SystemPtrsetSystem (const SystemPtr &system)
virtual const SystemPtrsetSystem (System *system)
template<typename ConcreteSystemModel >
const SystemPtrsetSystemModel (ConcreteSystemModel *system_model, const std::string &name="system")
virtual bool setSystemStatus (SystemStatus new_status)
virtual void setSystemStatusCallback (SystemStatusCallback callback)
virtual void setTimestamp (ros::Time timestamp)
virtual void update (const SystemInput &input, ros::Time timestamp)
virtual void update (double dt)
virtual void updated ()
virtual bool updateMeasurementStatus (SystemStatus set, SystemStatus clear)
virtual bool updateSystemStatus (SystemStatus set, SystemStatus clear)
virtual void updateWorldToOtherTransform (tf::StampedTransform &world_to_other_transform)
virtual ~PoseEstimation ()

Static Public Member Functions

static PoseEstimationInstance ()

Protected Types

typedef std::vector
< MeasurementPtr
Measurements

Protected Attributes

Measurements measurements_
SystemPtr system_

Private Attributes

ros::Time alignment_start_
double alignment_time_
std::string base_frame_
StateCovariance covariance_
bool covariance_is_dirty_
boost::shared_ptr
< BFL::ExtendedKalmanFilter > 
filter_
std::string footprint_frame_
GlobalReference global_reference_
boost::shared_ptr< Gravitygravity_
SystemStatus measurement_status_
std::string nav_frame_
ParameterList parameters_
std::string position_frame_
boost::shared_ptr< Raterate_
std::string stabilized_frame_
StateVector state_
bool state_is_dirty_
SystemStatus status_
SystemStatusCallback status_callback_
ros::Time timestamp_
std::string world_frame_
boost::shared_ptr< ZeroRatezerorate_

Detailed Description

Definition at line 61 of file pose_estimation.h.


Member Typedef Documentation

Definition at line 159 of file pose_estimation.h.

Definition at line 106 of file pose_estimation.h.


Constructor & Destructor Documentation

Definition at line 38 of file pose_estimation.cpp.

template<typename ConcreteSystemModel >
hector_pose_estimation::PoseEstimation::PoseEstimation ( ConcreteSystemModel *  system_model)

Definition at line 203 of file pose_estimation.h.

Definition at line 75 of file pose_estimation.cpp.


Member Function Documentation

Definition at line 290 of file pose_estimation.cpp.

Definition at line 300 of file pose_estimation.cpp.

const MeasurementPtr & hector_pose_estimation::PoseEstimation::addMeasurement ( const std::string &  name,
const MeasurementPtr measurement 
) [virtual]

Definition at line 295 of file pose_estimation.cpp.

template<class ConcreteMeasurementModel >
const MeasurementPtr& hector_pose_estimation::PoseEstimation::addMeasurement ( const std::string &  name,
ConcreteMeasurementModel *  model 
) [inline]

Definition at line 89 of file pose_estimation.h.

Definition at line 106 of file pose_estimation.cpp.

virtual BFL::KalmanFilter* hector_pose_estimation::PoseEstimation::filter ( ) [inline, virtual]

Definition at line 152 of file pose_estimation.h.

virtual const BFL::KalmanFilter* hector_pose_estimation::PoseEstimation::filter ( ) const [inline, virtual]

Definition at line 153 of file pose_estimation.h.

void hector_pose_estimation::PoseEstimation::getBias ( tf::Vector3 &  angular_velocity,
tf::Vector3 &  linear_acceleration 
) [virtual]

Definition at line 674 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getBias ( tf::Stamped< tf::Vector3 > &  angular_velocity,
tf::Stamped< tf::Vector3 > &  linear_acceleration 
) [virtual]

Definition at line 684 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getBias ( geometry_msgs::Vector3 &  angular_velocity,
geometry_msgs::Vector3 &  linear_acceleration 
) [virtual]

Definition at line 692 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getBias ( geometry_msgs::Vector3Stamped &  angular_velocity,
geometry_msgs::Vector3Stamped &  linear_acceleration 
) [virtual]

Definition at line 702 of file pose_estimation.cpp.

Definition at line 319 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getGlobalPosition ( double &  latitude,
double &  longitude,
double &  altitude 
) [virtual]

Definition at line 516 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getGlobalPosition ( sensor_msgs::NavSatFix &  global) [virtual]

Definition at line 525 of file pose_estimation.cpp.

Definition at line 393 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getImuWithBiases ( geometry_msgs::Vector3 &  linear_acceleration,
geometry_msgs::Vector3 &  angular_velocity 
) [virtual]

Definition at line 575 of file pose_estimation.cpp.

MeasurementPtr hector_pose_estimation::PoseEstimation::getMeasurement ( const std::string &  name) const [virtual]

Definition at line 304 of file pose_estimation.cpp.

Definition at line 343 of file pose_estimation.cpp.

Definition at line 541 of file pose_estimation.cpp.

Definition at line 546 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getOrientation ( geometry_msgs::Quaternion &  pose) [virtual]

Definition at line 552 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getOrientation ( geometry_msgs::QuaternionStamped &  pose) [virtual]

Definition at line 560 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getOrientation ( double &  yaw,
double &  pitch,
double &  roll 
) [virtual]

Definition at line 565 of file pose_estimation.cpp.

Definition at line 790 of file pose_estimation.cpp.

Definition at line 470 of file pose_estimation.cpp.

Definition at line 477 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getPose ( geometry_msgs::PoseStamped &  pose) [virtual]

Definition at line 488 of file pose_estimation.cpp.

Definition at line 493 of file pose_estimation.cpp.

Definition at line 498 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getPosition ( geometry_msgs::PointStamped &  pose) [virtual]

Definition at line 511 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getRate ( tf::Vector3 &  vector) [virtual]

Definition at line 629 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getRate ( tf::Stamped< tf::Vector3 > &  vector) [virtual]

Definition at line 643 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getRate ( geometry_msgs::Vector3 &  vector) [virtual]

Definition at line 649 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getRate ( geometry_msgs::Vector3Stamped &  vector) [virtual]

Definition at line 669 of file pose_estimation.cpp.

Definition at line 311 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getState ( nav_msgs::Odometry &  state,
bool  with_covariances = true 
) [virtual]

Definition at line 398 of file pose_estimation.cpp.

Definition at line 286 of file pose_estimation.cpp.

Definition at line 281 of file pose_estimation.cpp.

Definition at line 339 of file pose_estimation.cpp.

Definition at line 385 of file pose_estimation.cpp.

Definition at line 710 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getVelocity ( tf::Vector3 &  vector) [virtual]

Definition at line 606 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getVelocity ( tf::Stamped< tf::Vector3 > &  vector) [virtual]

Definition at line 611 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getVelocity ( geometry_msgs::Vector3 &  vector) [virtual]

Definition at line 617 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::getVelocity ( geometry_msgs::Vector3Stamped &  vector) [virtual]

Definition at line 624 of file pose_estimation.cpp.

Definition at line 804 of file pose_estimation.cpp.

Definition at line 85 of file pose_estimation.cpp.

Definition at line 80 of file pose_estimation.cpp.

Definition at line 347 of file pose_estimation.cpp.

Definition at line 149 of file pose_estimation.h.

virtual const ParameterList& hector_pose_estimation::PoseEstimation::parameters ( ) const [inline, virtual]

Definition at line 150 of file pose_estimation.h.

Definition at line 118 of file pose_estimation.cpp.

Definition at line 333 of file pose_estimation.cpp.

Definition at line 363 of file pose_estimation.cpp.

Definition at line 327 of file pose_estimation.cpp.

Definition at line 267 of file pose_estimation.cpp.

Definition at line 277 of file pose_estimation.cpp.

template<typename ConcreteSystemModel >
const SystemPtr & hector_pose_estimation::PoseEstimation::setSystemModel ( ConcreteSystemModel *  system_model,
const std::string &  name = "system" 
)

Definition at line 196 of file pose_estimation.h.

Definition at line 351 of file pose_estimation.cpp.

Definition at line 381 of file pose_estimation.cpp.

Definition at line 389 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::update ( const SystemInput input,
ros::Time  timestamp 
) [virtual]

Definition at line 144 of file pose_estimation.cpp.

void hector_pose_estimation::PoseEstimation::update ( double  dt) [virtual]

Definition at line 160 of file pose_estimation.cpp.

Definition at line 262 of file pose_estimation.cpp.

Definition at line 377 of file pose_estimation.cpp.

Definition at line 373 of file pose_estimation.cpp.

Definition at line 778 of file pose_estimation.cpp.


Member Data Documentation

Definition at line 184 of file pose_estimation.h.

Definition at line 185 of file pose_estimation.h.

Definition at line 179 of file pose_estimation.h.

Definition at line 166 of file pose_estimation.h.

Definition at line 168 of file pose_estimation.h.

boost::shared_ptr<BFL::ExtendedKalmanFilter> hector_pose_estimation::PoseEstimation::filter_ [private]

Definition at line 163 of file pose_estimation.h.

Definition at line 181 of file pose_estimation.h.

Definition at line 174 of file pose_estimation.h.

Definition at line 190 of file pose_estimation.h.

Definition at line 171 of file pose_estimation.h.

Definition at line 160 of file pose_estimation.h.

Definition at line 178 of file pose_estimation.h.

Definition at line 172 of file pose_estimation.h.

Definition at line 182 of file pose_estimation.h.

Definition at line 189 of file pose_estimation.h.

Definition at line 180 of file pose_estimation.h.

Definition at line 165 of file pose_estimation.h.

Definition at line 167 of file pose_estimation.h.

Definition at line 170 of file pose_estimation.h.

Definition at line 187 of file pose_estimation.h.

Definition at line 158 of file pose_estimation.h.

Definition at line 176 of file pose_estimation.h.

Definition at line 177 of file pose_estimation.h.

Definition at line 191 of file pose_estimation.h.


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


hector_pose_estimation_core
Author(s): Johannes Meyer
autogenerated on Mon Jul 15 2013 16:48:44