$search
std_msgs::ColorRGBA object_manipulator::msg::createColorMsg | ( | const float | red, | |
const float | blue, | |||
const float | green, | |||
const float | alpha = 1.0 | |||
) | [inline] |
Definition at line 57 of file msg_helpers.h.
geometry_msgs::Point object_manipulator::msg::createPointMsg | ( | const tf::Point & | v | ) | [inline] |
Definition at line 92 of file msg_helpers.h.
geometry_msgs::Point object_manipulator::msg::createPointMsg | ( | const float | x, | |
const float | y, | |||
const float | z | |||
) | [inline] |
Definition at line 84 of file msg_helpers.h.
geometry_msgs::Pose object_manipulator::msg::createPoseMsg | ( | const geometry_msgs::Vector3 & | v, | |
const geometry_msgs::Quaternion & | q | |||
) | [inline] |
Definition at line 128 of file msg_helpers.h.
geometry_msgs::Pose object_manipulator::msg::createPoseMsg | ( | const geometry_msgs::Point & | v, | |
const geometry_msgs::Quaternion & | q | |||
) | [inline] |
Definition at line 120 of file msg_helpers.h.
geometry_msgs::PoseStamped object_manipulator::msg::createPoseStampedMsg | ( | const geometry_msgs::Point & | v, | |
const geometry_msgs::Quaternion & | q, | |||
const std::string & | frame_id, | |||
const ros::Time & | stamp | |||
) | [inline] |
Definition at line 146 of file msg_helpers.h.
geometry_msgs::PoseStamped object_manipulator::msg::createPoseStampedMsg | ( | const geometry_msgs::Pose & | p, | |
const std::string & | frame_id, | |||
const ros::Time & | stamp | |||
) | [inline] |
Definition at line 137 of file msg_helpers.h.
geometry_msgs::Quaternion object_manipulator::msg::createQuaternionMsg | ( | const tf::Quaternion & | q | ) | [inline] |
Definition at line 110 of file msg_helpers.h.
geometry_msgs::Quaternion object_manipulator::msg::createQuaternionMsg | ( | const float | x, | |
const float | y, | |||
const float | z, | |||
const float | w | |||
) | [inline] |
Definition at line 101 of file msg_helpers.h.
geometry_msgs::Transform object_manipulator::msg::createTransformMsg | ( | const geometry_msgs::Vector3 & | v, | |
const geometry_msgs::Quaternion & | q | |||
) | [inline] |
Definition at line 160 of file msg_helpers.h.
geometry_msgs::Transform object_manipulator::msg::createTransformMsg | ( | const geometry_msgs::Point & | v, | |
const geometry_msgs::Quaternion & | q | |||
) | [inline] |
Definition at line 152 of file msg_helpers.h.
geometry_msgs::TransformStamped object_manipulator::msg::createTransformStampedMsg | ( | const geometry_msgs::Vector3 & | v, | |
const geometry_msgs::Quaternion & | q, | |||
const std::string & | frame_id, | |||
const ros::Time & | stamp | |||
) | [inline] |
Definition at line 177 of file msg_helpers.h.
geometry_msgs::TransformStamped object_manipulator::msg::createTransformStampedMsg | ( | const geometry_msgs::Transform & | t, | |
const std::string & | frame_id, | |||
const ros::Time & | stamp | |||
) | [inline] |
Definition at line 168 of file msg_helpers.h.
geometry_msgs::Vector3 object_manipulator::msg::createVector3Msg | ( | const tf::Vector3 & | v | ) | [inline] |
Definition at line 75 of file msg_helpers.h.
geometry_msgs::Vector3 object_manipulator::msg::createVector3Msg | ( | const float | x, | |
const float | y, | |||
const float | z | |||
) | [inline] |
Definition at line 67 of file msg_helpers.h.