#include <velocity.h>
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_ |
Definition at line 51 of file velocity.h.
semanticmodel::VelocityCalc::VelocityCalc | ( | boost::shared_ptr< mongo_ros::TransformSource > | transforms, |
const std::string & | reference_frame | ||
) | [inline] |
transforms | Wraps a tf listener or TransformCollection |
reference_frame | Returned velocities will equal the rate of change of the point coordinates wrt this frame |
Definition at line 58 of file velocity.h.
gm::Vector3 semanticmodel::VelocityCalc::velocity | ( | const geometry_msgs::PointStamped & | p | ) | const |
p | The point whose velocity we care about. Both the frame_id and |
Definition at line 59 of file velocity.cc.
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.
boost::shared_ptr<mongo_ros::TransformSource> semanticmodel::VelocityCalc::transforms_ [private] |
Definition at line 71 of file velocity.h.