#include <ViconSegment.hpp>
Public Member Functions | |
| int | getSegmentID () const |
| std::string | getSegmentName () const |
| ViconSegment & | operator= (const ViconSegment &other) |
| void | publish (const Eigen::Vector3d &globalTranslation, const Eigen::Quaterniond &globalOrientation) |
| ViconSegment (ViconSubject &parent_, int segmentID_, const std::string segmentName_) | |
| virtual | ~ViconSegment () |
Private Attributes | |
| ViconSubject & | parent |
| geometry_msgs::PoseStamped | poseMsg |
| ros::Publisher | posePublisher |
| int | segmentID |
| std::string | segmentName |
Definition at line 26 of file ViconSegment.hpp.
| TELEKYB_NAMESPACE::ViconSegment::ViconSegment | ( | ViconSubject & | parent_, |
| int | segmentID_, | ||
| const std::string | segmentName_ | ||
| ) |
Definition at line 16 of file ViconSegment.cpp.
| TELEKYB_NAMESPACE::ViconSegment::~ViconSegment | ( | ) | [virtual] |
Definition at line 37 of file ViconSegment.cpp.
| int TELEKYB_NAMESPACE::ViconSegment::getSegmentID | ( | ) | const |
Definition at line 59 of file ViconSegment.cpp.
| std::string TELEKYB_NAMESPACE::ViconSegment::getSegmentName | ( | ) | const |
Definition at line 64 of file ViconSegment.cpp.
| ViconSegment & TELEKYB_NAMESPACE::ViconSegment::operator= | ( | const ViconSegment & | other | ) |
Definition at line 28 of file ViconSegment.cpp.
| void TELEKYB_NAMESPACE::ViconSegment::publish | ( | const Eigen::Vector3d & | globalTranslation, |
| const Eigen::Quaterniond & | globalOrientation | ||
| ) |
Definition at line 42 of file ViconSegment.cpp.
Definition at line 39 of file ViconSegment.hpp.
geometry_msgs::PoseStamped TELEKYB_NAMESPACE::ViconSegment::poseMsg [private] |
Definition at line 44 of file ViconSegment.hpp.
Definition at line 42 of file ViconSegment.hpp.
int TELEKYB_NAMESPACE::ViconSegment::segmentID [private] |
Definition at line 40 of file ViconSegment.hpp.
std::string TELEKYB_NAMESPACE::ViconSegment::segmentName [private] |
Definition at line 41 of file ViconSegment.hpp.