moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Protected Member Functions | Protected Attributes | List of all members
ServoCppFixture Class Reference

#include <servo_cpp_fixture.hpp>

Inheritance diagram for ServoCppFixture:
Inheritance graph
[legend]
Collaboration diagram for ServoCppFixture:
Collaboration graph
[legend]

Protected Member Functions

void SetUp () override
 
Eigen::Isometry3d getCurrentPose (const std::string &target_frame) const
 Helper function to get the current pose of a specified frame.
 

Protected Attributes

std::shared_ptr< rclcpp::Node > servo_test_node_
 
std::shared_ptr< const servo::ParamListener > servo_param_listener_
 
servo::Params servo_params_
 
std::shared_ptr< moveit_servo::Servoservo_test_instance_
 
planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor_
 

Detailed Description

Definition at line 50 of file servo_cpp_fixture.hpp.

Member Function Documentation

◆ getCurrentPose()

Eigen::Isometry3d ServoCppFixture::getCurrentPose ( const std::string &  target_frame) const
inlineprotected

Helper function to get the current pose of a specified frame.

Definition at line 70 of file servo_cpp_fixture.hpp.

◆ SetUp()

void ServoCppFixture::SetUp ( )
inlineoverrideprotected

Definition at line 53 of file servo_cpp_fixture.hpp.

Here is the call graph for this function:

Member Data Documentation

◆ planning_scene_monitor_

planning_scene_monitor::PlanningSceneMonitorPtr ServoCppFixture::planning_scene_monitor_
protected

Definition at line 79 of file servo_cpp_fixture.hpp.

◆ servo_param_listener_

std::shared_ptr<const servo::ParamListener> ServoCppFixture::servo_param_listener_
protected

Definition at line 76 of file servo_cpp_fixture.hpp.

◆ servo_params_

servo::Params ServoCppFixture::servo_params_
protected

Definition at line 77 of file servo_cpp_fixture.hpp.

◆ servo_test_instance_

std::shared_ptr<moveit_servo::Servo> ServoCppFixture::servo_test_instance_
protected

Definition at line 78 of file servo_cpp_fixture.hpp.

◆ servo_test_node_

std::shared_ptr<rclcpp::Node> ServoCppFixture::servo_test_node_
protected

Definition at line 75 of file servo_cpp_fixture.hpp.


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