Static Public Member Functions | List of all members
xpp::Convert Struct Reference

Converts between xpp-states types and xpp-messages. More...

#include <convert.h>

Static Public Member Functions

static geometry_msgs::Quaternion ToRos (const Eigen::Quaterniond xpp)
 
static xpp_msgs::RobotStateCartesian ToRos (const RobotStateCartesian &xpp)
 
static xpp_msgs::State6d ToRos (const State3d &xpp)
 
static xpp_msgs::StateLin3d ToRos (const StateLin3d &xpp)
 
static xpp_msgs::RobotStateCartesianTrajectory ToRos (const std::vector< RobotStateCartesian > &xpp)
 
template<typename T >
static T ToRos (const Vector3d &xpp)
 
static Eigen::Quaterniond ToXpp (const geometry_msgs::Quaternion ros)
 
template<typename T >
static Endeffectors< Vector3dToXpp (const std::vector< T > &ros)
 
template<typename T >
static Vector3d ToXpp (const T &ros)
 
static RobotStateCartesian ToXpp (const xpp_msgs::RobotStateCartesian &ros)
 
static std::vector< RobotStateCartesianToXpp (const xpp_msgs::RobotStateCartesianTrajectory &ros)
 
static State3d ToXpp (const xpp_msgs::State6d &ros)
 
static StateLin3d ToXpp (const xpp_msgs::StateLin3d &ros)
 

Detailed Description

Converts between xpp-states types and xpp-messages.

ToXpp() : Convert from ROS message (xpp_msgs) to state (xpp_states). ToRos() : Convert from state (xpp_states) to ROS message (xpp_msgs).

Definition at line 78 of file convert.h.

Member Function Documentation

◆ ToRos() [1/6]

static geometry_msgs::Quaternion xpp::Convert::ToRos ( const Eigen::Quaterniond  xpp)
inlinestatic

Definition at line 191 of file convert.h.

◆ ToRos() [2/6]

static xpp_msgs::RobotStateCartesian xpp::Convert::ToRos ( const RobotStateCartesian xpp)
inlinestatic

Definition at line 235 of file convert.h.

◆ ToRos() [3/6]

static xpp_msgs::State6d xpp::Convert::ToRos ( const State3d xpp)
inlinestatic

Definition at line 203 of file convert.h.

◆ ToRos() [4/6]

static xpp_msgs::StateLin3d xpp::Convert::ToRos ( const StateLin3d xpp)
inlinestatic

Definition at line 127 of file convert.h.

◆ ToRos() [5/6]

static xpp_msgs::RobotStateCartesianTrajectory xpp::Convert::ToRos ( const std::vector< RobotStateCartesian > &  xpp)
inlinestatic

Definition at line 271 of file convert.h.

◆ ToRos() [6/6]

template<typename T >
static T xpp::Convert::ToRos ( const Vector3d xpp)
inlinestatic

Definition at line 156 of file convert.h.

◆ ToXpp() [1/7]

static Eigen::Quaterniond xpp::Convert::ToXpp ( const geometry_msgs::Quaternion  ros)
inlinestatic

Definition at line 179 of file convert.h.

◆ ToXpp() [2/7]

template<typename T >
static Endeffectors<Vector3d> xpp::Convert::ToXpp ( const std::vector< T > &  ros)
inlinestatic

Definition at line 168 of file convert.h.

◆ ToXpp() [3/7]

template<typename T >
static Vector3d xpp::Convert::ToXpp ( const T &  ros)
inlinestatic

Definition at line 147 of file convert.h.

◆ ToXpp() [4/7]

static RobotStateCartesian xpp::Convert::ToXpp ( const xpp_msgs::RobotStateCartesian &  ros)
inlinestatic

Definition at line 252 of file convert.h.

◆ ToXpp() [5/7]

static std::vector<RobotStateCartesian> xpp::Convert::ToXpp ( const xpp_msgs::RobotStateCartesianTrajectory &  ros)
inlinestatic

Definition at line 284 of file convert.h.

◆ ToXpp() [6/7]

static State3d xpp::Convert::ToXpp ( const xpp_msgs::State6d &  ros)
inlinestatic

Definition at line 219 of file convert.h.

◆ ToXpp() [7/7]

static StateLin3d xpp::Convert::ToXpp ( const xpp_msgs::StateLin3d &  ros)
inlinestatic

Definition at line 108 of file convert.h.


The documentation for this struct was generated from the following file:


xpp_states
Author(s): Alexander W. Winkler
autogenerated on Wed Mar 2 2022 01:14:14