Classes | |
class | RotationProperty |
class | TransformPublisherDisplay |
Functions | |
static vm::Marker | createArrowMarker (double scale, const Eigen::Vector3d &dir, const QColor &color) |
static bool | getTransform (rviz::FrameManager &fm, const std::string &frame, Eigen::Affine3d &tf) |
void | setOrientation (geometry_msgs::Quaternion &q, double w, double x, double y, double z) |
static void | updatePose (geometry_msgs::Pose &pose, const Eigen::Quaterniond &q, Ogre::Vector3 p=Ogre::Vector3::ZERO) |
static vm::Marker agni_tf_tools::createArrowMarker | ( | double | scale, |
const Eigen::Vector3d & | dir, | ||
const QColor & | color | ||
) | [static] |
Definition at line 163 of file TransformPublisherDisplay.cpp.
static bool agni_tf_tools::getTransform | ( | rviz::FrameManager & | fm, |
const std::string & | frame, | ||
Eigen::Affine3d & | tf | ||
) | [static] |
Definition at line 318 of file TransformPublisherDisplay.cpp.
void agni_tf_tools::setOrientation | ( | geometry_msgs::Quaternion & | q, |
double | w, | ||
double | x, | ||
double | y, | ||
double | z | ||
) | [inline] |
Definition at line 184 of file TransformPublisherDisplay.cpp.
static void agni_tf_tools::updatePose | ( | geometry_msgs::Pose & | pose, |
const Eigen::Quaterniond & | q, | ||
Ogre::Vector3 | p = Ogre::Vector3::ZERO |
||
) | [static] |
Definition at line 59 of file TransformPublisherDisplay.cpp.