Protected Member Functions | Protected Attributes | List of all members
SimpleBotFixture Class Reference
Inheritance diagram for SimpleBotFixture:
Inheritance graph
[legend]

Protected Member Functions

void positionCB (const sensor_msgs::JointState &msg)
 
void SetUp () override
 
bool waitToReachTarget (double target, std::string &err, double precision=5e-2, double timeout=20.0)
 

Protected Attributes

ros::NodeHandle nh
 
double position
 
ros::Publisher pub
 
ros::Subscriber sub
 

Detailed Description

Definition at line 42 of file simple_bot_goto_position.cpp.

Member Function Documentation

◆ positionCB()

void SimpleBotFixture::positionCB ( const sensor_msgs::JointState &  msg)
inlineprotected

Definition at line 81 of file simple_bot_goto_position.cpp.

◆ SetUp()

void SimpleBotFixture::SetUp ( )
inlineoverrideprotected

Definition at line 108 of file simple_bot_goto_position.cpp.

◆ waitToReachTarget()

bool SimpleBotFixture::waitToReachTarget ( double  target,
std::string &  err,
double  precision = 5e-2,
double  timeout = 20.0 
)
inlineprotected

Definition at line 85 of file simple_bot_goto_position.cpp.

Member Data Documentation

◆ nh

ros::NodeHandle SimpleBotFixture::nh
protected

Definition at line 78 of file simple_bot_goto_position.cpp.

◆ position

double SimpleBotFixture::position
protected

Definition at line 79 of file simple_bot_goto_position.cpp.

◆ pub

ros::Publisher SimpleBotFixture::pub
protected

Definition at line 76 of file simple_bot_goto_position.cpp.

◆ sub

ros::Subscriber SimpleBotFixture::sub
protected

Definition at line 77 of file simple_bot_goto_position.cpp.


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


effort_controllers
Author(s): Vijay Pradeep
autogenerated on Fri May 24 2024 02:41:22