#include "OgreVector3.h"
#include "OgreQuaternion.h"
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Vector3.h>
#include <geometry_msgs/Quaternion.h>
Go to the source code of this file.
Namespaces | |
namespace | rviz |
Functions | |
static Ogre::Vector3 | rviz::pointMsgToOgre (const geometry_msgs::Point &m) |
static void | rviz::pointMsgToOgre (const geometry_msgs::Point &m, Ogre::Vector3 &o) |
static void | rviz::pointOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Point &m) |
static geometry_msgs::Point | rviz::pointOgreToMsg (const Ogre::Vector3 &o) |
static Ogre::Quaternion | rviz::quaternionMsgToOgre (const geometry_msgs::Quaternion &m) |
static void | rviz::quaternionMsgToOgre (const geometry_msgs::Quaternion &m, Ogre::Quaternion &o) |
static void | rviz::quaternionOgreToMsg (const Ogre::Quaternion &o, geometry_msgs::Quaternion &m) |
static geometry_msgs::Quaternion | rviz::quaternionOgreToMsg (const Ogre::Quaternion &o) |
static Ogre::Vector3 | rviz::vector3MsgToOgre (const geometry_msgs::Vector3 &m) |
static void | rviz::vector3MsgToOgre (const geometry_msgs::Vector3 &m, Ogre::Vector3 &o) |
static void | rviz::vector3OgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Vector3 &m) |
static geometry_msgs::Vector3 | rviz::vector3OgreToMsg (const Ogre::Vector3 &o) |