moveit2
The MoveIt Motion Planning Framework for ROS 2.
Namespaces | Functions
robot_state.cpp File Reference
#include "robot_state.h"
#include <pybind11/stl.h>
#include <moveit_py/moveit_py_utils/ros_msg_typecasters.h>
#include <moveit_msgs/msg/robot_state.hpp>
#include <moveit/robot_state/conversions.h>
Include dependency graph for robot_state.cpp:

Go to the source code of this file.

Namespaces

 moveit_py
 
 moveit_py::bind_robot_state
 

Functions

void moveit_py::bind_robot_state::update (moveit::core::RobotState *self, bool force, std::string &category)
 
Eigen::MatrixXd moveit_py::bind_robot_state::getFrameTransform (const moveit::core::RobotState *self, std::string &frame_id)
 
Eigen::MatrixXd moveit_py::bind_robot_state::getGlobalLinkTransform (const moveit::core::RobotState *self, std::string &link_name)
 
geometry_msgs::msg::Pose moveit_py::bind_robot_state::getPose (const moveit::core::RobotState *self, const std::string &link_name)
 
std::map< std::string, double > moveit_py::bind_robot_state::getJointPositions (const moveit::core::RobotState *self)
 
void moveit_py::bind_robot_state::setJointPositions (moveit::core::RobotState *self, std::map< std::string, double > &joint_positions)
 
std::map< std::string, double > moveit_py::bind_robot_state::getJointVelocities (const moveit::core::RobotState *self)
 
void moveit_py::bind_robot_state::setJointVelocities (moveit::core::RobotState *self, std::map< std::string, double > &joint_velocities)
 
std::map< std::string, double > moveit_py::bind_robot_state::getJointAccelerations (const moveit::core::RobotState *self)
 
void moveit_py::bind_robot_state::setJointAccelerations (moveit::core::RobotState *self, std::map< std::string, double > &joint_accelerations)
 
std::map< std::string, double > moveit_py::bind_robot_state::getJointEfforts (const moveit::core::RobotState *self)
 
void moveit_py::bind_robot_state::setJointEfforts (moveit::core::RobotState *self, std::map< std::string, double > &joint_efforts)
 
Eigen::VectorXd moveit_py::bind_robot_state::copyJointGroupPositions (const moveit::core::RobotState *self, const std::string &joint_model_group_name)
 
Eigen::VectorXd moveit_py::bind_robot_state::copyJointGroupVelocities (const moveit::core::RobotState *self, const std::string &joint_model_group_name)
 
Eigen::VectorXd moveit_py::bind_robot_state::copyJointGroupAccelerations (const moveit::core::RobotState *self, const std::string &joint_model_group_name)
 
Eigen::MatrixXd moveit_py::bind_robot_state::getJacobian (const moveit::core::RobotState *self, const std::string &joint_model_group_name, const Eigen::Vector3d &reference_point_position)
 
Eigen::MatrixXd moveit_py::bind_robot_state::getJacobian (const moveit::core::RobotState *self, const std::string &joint_model_group_name, const std::string &link_model_name, const Eigen::Vector3d &reference_point_position, bool use_quaternion_representation)
 
bool moveit_py::bind_robot_state::setToDefaultValues (moveit::core::RobotState *self, const std::string &joint_model_group_name, const std::string &state_name)
 
void moveit_py::bind_robot_state::initRobotState (py::module &m)