|
wbc_ros
|
#include "conversions.hpp"Functions | |
| void | fromROS (const geometry_msgs::msg::Pose &in, wbc::types::Pose &out) |
| void | fromROS (const geometry_msgs::msg::Twist &in, wbc::types::Twist &out) |
| void | fromROS (const geometry_msgs::msg::Accel &in, wbc::types::SpatialAcceleration &out) |
| void | fromROS (const geometry_msgs::msg::Wrench &in, wbc::types::Wrench &out) |
| void | fromROS (const robot_control_msgs::msg::JointState &in, const std::vector< int > &joint_indices, wbc::types::JointState &out) |
| void | fromROS (const robot_control_msgs::msg::RigidBodyState &in, wbc::types::RigidBodyState &out) |
| void | fromROS (const robot_control_msgs::msg::JointCommand &in, const std::vector< int > &joint_indices, wbc::types::JointCommand &out) |
| void | fromROS (const robot_control_msgs::msg::Contacts &in, std::vector< wbc::types::Contact > &out) |
| void | fromROS (const std_msgs::msg::Float64MultiArray &in, Eigen::VectorXd &out) |
| void | fromROS (const robot_control_msgs::msg::RobotState &in, const std::vector< int > &joint_indices, wbc::types::JointState &joint_state_out, wbc::types::RigidBodyState &floating_base_state_out) |
| void | toROS (const wbc::types::RigidBodyState &in, robot_control_msgs::msg::RigidBodyState &out) |
| void | toROS (const wbc::types::JointCommand &in, const std::vector< int > &joint_indices, robot_control_msgs::msg::JointCommand &out) |
| void | toROS (const wbc::types::JointCommand &in, const std::vector< double > &kp, const std::vector< double > &kd, const std::vector< int > &joint_indices, robot_control_msgs::msg::JointCommand &out) |
| void | toROS (const Eigen::VectorXd &in, std_msgs::msg::Float64MultiArray &out) |
| void | toROS (const wbc::types::Pose &in, geometry_msgs::msg::Pose &out) |
| void | toROS (const wbc::types::Twist &in, geometry_msgs::msg::Twist &out) |
| void | toROS (const wbc::types::SpatialAcceleration &in, geometry_msgs::msg::Accel &out) |
| void | toROS (const wbc::types::Pose &pose, const wbc::types::Twist &twist, const wbc::types::SpatialAcceleration &acc, robot_control_msgs::msg::RigidBodyState &out) |
| void | toROS (const wbc::types::JointState &in, const std::vector< int > &joint_indices, robot_control_msgs::msg::JointState &out) |
| void fromROS | ( | const geometry_msgs::msg::Accel & | in, |
| wbc::types::SpatialAcceleration & | out ) |
| void fromROS | ( | const geometry_msgs::msg::Pose & | in, |
| wbc::types::Pose & | out ) |
| void fromROS | ( | const geometry_msgs::msg::Twist & | in, |
| wbc::types::Twist & | out ) |
| void fromROS | ( | const geometry_msgs::msg::Wrench & | in, |
| wbc::types::Wrench & | out ) |
| void fromROS | ( | const robot_control_msgs::msg::Contacts & | in, |
| std::vector< wbc::types::Contact > & | out ) |
| void fromROS | ( | const robot_control_msgs::msg::JointCommand & | in, |
| const std::vector< int > & | joint_indices, | ||
| wbc::types::JointCommand & | out ) |
| void fromROS | ( | const robot_control_msgs::msg::JointState & | in, |
| const std::vector< int > & | joint_indices, | ||
| wbc::types::JointState & | out ) |
| void fromROS | ( | const robot_control_msgs::msg::RigidBodyState & | in, |
| wbc::types::RigidBodyState & | out ) |
| void fromROS | ( | const robot_control_msgs::msg::RobotState & | in, |
| const std::vector< int > & | joint_indices, | ||
| wbc::types::JointState & | joint_state_out, | ||
| wbc::types::RigidBodyState & | floating_base_state_out ) |
| void fromROS | ( | const std_msgs::msg::Float64MultiArray & | in, |
| Eigen::VectorXd & | out ) |
| void toROS | ( | const Eigen::VectorXd & | in, |
| std_msgs::msg::Float64MultiArray & | out ) |
| void toROS | ( | const wbc::types::JointCommand & | in, |
| const std::vector< double > & | kp, | ||
| const std::vector< double > & | kd, | ||
| const std::vector< int > & | joint_indices, | ||
| robot_control_msgs::msg::JointCommand & | out ) |
| void toROS | ( | const wbc::types::JointCommand & | in, |
| const std::vector< int > & | joint_indices, | ||
| robot_control_msgs::msg::JointCommand & | out ) |
| void toROS | ( | const wbc::types::JointState & | in, |
| const std::vector< int > & | joint_indices, | ||
| robot_control_msgs::msg::JointState & | out ) |
| void toROS | ( | const wbc::types::Pose & | in, |
| geometry_msgs::msg::Pose & | out ) |
| void toROS | ( | const wbc::types::Pose & | pose, |
| const wbc::types::Twist & | twist, | ||
| const wbc::types::SpatialAcceleration & | acc, | ||
| robot_control_msgs::msg::RigidBodyState & | out ) |
| void toROS | ( | const wbc::types::RigidBodyState & | in, |
| robot_control_msgs::msg::RigidBodyState & | out ) |
| void toROS | ( | const wbc::types::SpatialAcceleration & | in, |
| geometry_msgs::msg::Accel & | out ) |
| void toROS | ( | const wbc::types::Twist & | in, |
| geometry_msgs::msg::Twist & | out ) |