#include "TransformPublisherDisplay.h"
#include "TransformBroadcaster.h"
#include "rotation_property.h"
#include <rviz/properties/string_property.h>
#include <rviz/properties/bool_property.h>
#include <rviz/properties/float_property.h>
#include <rviz/properties/vector_property.h>
#include <rviz/properties/tf_frame_property.h>
#include <rviz/properties/enum_property.h>
#include <rviz/display_factory.h>
#include <rviz/display_context.h>
#include <rviz/frame_manager.h>
#include <rviz/default_plugin/interactive_markers/interactive_marker.h>
#include <interactive_markers/tools.h>
#include <tf/transform_listener.h>
#include <QDebug>
Go to the source code of this file.
Namespaces | |
agni_tf_tools | |
Enumerations | |
enum | MARKER_TYPE { NONE, FRAME, IFRAME, DOF6 } |
Functions | |
static vm::Marker | agni_tf_tools::createArrowMarker (double scale, const Eigen::Vector3d &dir, const QColor &color) |
static bool | agni_tf_tools::getTransform (rviz::FrameManager &fm, const std::string &frame, Eigen::Affine3d &tf) |
void | agni_tf_tools::setOrientation (geometry_msgs::Quaternion &q, double w, double x, double y, double z) |
static void | agni_tf_tools::updatePose (geometry_msgs::Pose &pose, const Eigen::Quaterniond &q, Ogre::Vector3 p=Ogre::Vector3::ZERO) |
Variables | |
const std::string | MARKER_NAME = "marker" |
enum MARKER_TYPE |
Enumerator | |
---|---|
NONE | |
FRAME | |
IFRAME | |
DOF6 |
Definition at line 54 of file TransformPublisherDisplay.cpp.
const std::string MARKER_NAME = "marker" |
Definition at line 52 of file TransformPublisherDisplay.cpp.