moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs | Functions
robot_state.h File Reference
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/attached_body.h>
#include <moveit/transforms/transforms.h>
#include <sensor_msgs/msg/joint_state.hpp>
#include <visualization_msgs/msg/marker_array.hpp>
#include <std_msgs/msg/color_rgba.hpp>
#include <geometry_msgs/msg/twist.hpp>
#include <cassert>
#include <rclcpp/duration.hpp>
Include dependency graph for robot_state.h:

Go to the source code of this file.

Classes

class  moveit::core::RobotState
 Representation of a robot's state. This includes position, velocity, acceleration and effort. More...
 

Namespaces

 moveit
 Main namespace for MoveIt.
 
 moveit::core
 Core components of MoveIt.
 

Typedefs

typedef std::function< bool(RobotState *robot_state, const JointModelGroup *joint_group, const double *joint_group_variable_values)> moveit::core::GroupStateValidityCallbackFn
 Signature for functions that can verify that if the group joint_group in robot_state is set to joint_group_variable_values the state is valid or not. Returns true if the state is valid. This call is allowed to modify robot_state (e.g., set joint_group_variable_values) More...
 

Functions

 moveit::core::MOVEIT_CLASS_FORWARD (RobotState)
 
std::ostream & moveit::core::operator<< (std::ostream &out, const RobotState &s)
 Operator overload for printing variable bounds to a stream. More...