moveit2
The MoveIt Motion Planning Framework for ROS 2.
Protected Member Functions | Static Protected Member Functions | Protected Attributes | Static Protected Attributes | List of all members
PandaRobot Class Reference
Inheritance diagram for PandaRobot:
Inheritance graph
[legend]
Collaboration diagram for PandaRobot:
Collaboration graph
[legend]

Protected Member Functions

void SetUp () override
 
double computeCartesianPath (std::vector< std::shared_ptr< RobotState >> &result, const Eigen::Vector3d &translation, bool global)
 
double computeCartesianPath (std::vector< std::shared_ptr< RobotState >> &result, const Eigen::Isometry3d &target, bool global, const Eigen::Isometry3d &offset=Eigen::Isometry3d::Identity())
 

Static Protected Member Functions

static void SetUpTestSuite ()
 
static void TearDownTestSuite ()
 

Protected Attributes

double prec_ = 1e-8
 
RobotStatePtr start_state_
 
Eigen::Isometry3d start_pose_
 
std::vector< std::shared_ptr< RobotState > > result_
 

Static Protected Attributes

static RobotModelPtr robot_model_
 
static JointModelGroupjmg_
 
static const LinkModellink_
 
static rclcpp::Node::SharedPtr node_
 

Detailed Description

Definition at line 208 of file test_cartesian_interpolator.cpp.

Member Function Documentation

◆ computeCartesianPath() [1/2]

double PandaRobot::computeCartesianPath ( std::vector< std::shared_ptr< RobotState >> &  result,
const Eigen::Isometry3d &  target,
bool  global,
const Eigen::Isometry3d &  offset = Eigen::Isometry3d::Identity() 
)
inlineprotected

Definition at line 241 of file test_cartesian_interpolator.cpp.

Here is the call graph for this function:

◆ computeCartesianPath() [2/2]

double PandaRobot::computeCartesianPath ( std::vector< std::shared_ptr< RobotState >> &  result,
const Eigen::Vector3d &  translation,
bool  global 
)
inlineprotected

Definition at line 233 of file test_cartesian_interpolator.cpp.

Here is the call graph for this function:

◆ SetUp()

void PandaRobot::SetUp ( )
inlineoverrideprotected

Definition at line 226 of file test_cartesian_interpolator.cpp.

◆ SetUpTestSuite()

static void PandaRobot::SetUpTestSuite ( )
inlinestaticprotected

Definition at line 211 of file test_cartesian_interpolator.cpp.

Here is the call graph for this function:

◆ TearDownTestSuite()

static void PandaRobot::TearDownTestSuite ( )
inlinestaticprotected

Definition at line 221 of file test_cartesian_interpolator.cpp.

Member Data Documentation

◆ jmg_

JointModelGroup* PandaRobot::jmg_
staticprotected

Definition at line 252 of file test_cartesian_interpolator.cpp.

◆ link_

const LinkModel* PandaRobot::link_
staticprotected

Definition at line 253 of file test_cartesian_interpolator.cpp.

◆ node_

rclcpp::Node::SharedPtr PandaRobot::node_
staticprotected

Definition at line 254 of file test_cartesian_interpolator.cpp.

◆ prec_

double PandaRobot::prec_ = 1e-8
protected

Definition at line 256 of file test_cartesian_interpolator.cpp.

◆ result_

std::vector<std::shared_ptr<RobotState> > PandaRobot::result_
protected

Definition at line 259 of file test_cartesian_interpolator.cpp.

◆ robot_model_

RobotModelPtr PandaRobot::robot_model_
staticprotected

Definition at line 251 of file test_cartesian_interpolator.cpp.

◆ start_pose_

Eigen::Isometry3d PandaRobot::start_pose_
protected

Definition at line 258 of file test_cartesian_interpolator.cpp.

◆ start_state_

RobotStatePtr PandaRobot::start_state_
protected

Definition at line 257 of file test_cartesian_interpolator.cpp.


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