Public Member Functions | Private Attributes
semanticmodel::VelocityCalc Class Reference

#include <velocity.h>

List of all members.

Public Member Functions

geometry_msgs::Vector3 velocity (const geometry_msgs::PointStamped &p) const
 VelocityCalc (boost::shared_ptr< mongo_ros::TransformSource > transforms, const std::string &reference_frame)

Private Attributes

const float inc_
const std::string reference_frame_
boost::shared_ptr
< mongo_ros::TransformSource
transforms_

Detailed Description

Definition at line 51 of file velocity.h.


Constructor & Destructor Documentation

semanticmodel::VelocityCalc::VelocityCalc ( boost::shared_ptr< mongo_ros::TransformSource transforms,
const std::string &  reference_frame 
) [inline]
Parameters:
transformsWraps a tf listener or TransformCollection
reference_frameReturned velocities will equal the rate of change of the point coordinates wrt this frame

Definition at line 58 of file velocity.h.


Member Function Documentation

gm::Vector3 semanticmodel::VelocityCalc::velocity ( const geometry_msgs::PointStamped &  p) const
Parameters:
pThe point whose velocity we care about. Both the frame_id and

Definition at line 59 of file velocity.cc.


Member Data Documentation

const float semanticmodel::VelocityCalc::inc_ [private]

Definition at line 73 of file velocity.h.

const std::string semanticmodel::VelocityCalc::reference_frame_ [private]

Definition at line 72 of file velocity.h.

Definition at line 71 of file velocity.h.


The documentation for this class was generated from the following files:


semanticmodel
Author(s): Julian ("Mac") Mason
autogenerated on Thu Dec 12 2013 12:39:10