Public Member Functions | Private Attributes | List of all members
franka_example_controllers::JointVelocityExampleController Class Reference

#include <joint_velocity_example_controller.h>

Inheritance diagram for franka_example_controllers::JointVelocityExampleController:
Inheritance graph
[legend]

Public Member Functions

bool init (hardware_interface::RobotHW *robot_hardware, ros::NodeHandle &node_handle) override
 
void starting (const ros::Time &) override
 
void stopping (const ros::Time &) override
 
void update (const ros::Time &, const ros::Duration &period) override
 
- Public Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, franka_hw::FrankaStateInterface >
virtual bool init (hardware_interface::RobotHW *, ros::NodeHandle &, ros::NodeHandle &)
 
 MultiInterfaceController (bool allow_optional_interfaces=false)
 
- Public Member Functions inherited from controller_interface::ControllerBase
virtual void aborting (const ros::Time &)
 
virtual void aborting (const ros::Time &)
 
bool abortRequest (const ros::Time &time)
 
bool abortRequest (const ros::Time &time)
 
 ControllerBase ()=default
 
 ControllerBase (const ControllerBase &)=delete
 
 ControllerBase (ControllerBase &&)=delete
 
bool isAborted () const
 
bool isAborted () const
 
bool isInitialized () const
 
bool isInitialized () const
 
bool isRunning () const
 
bool isRunning () const
 
bool isStopped () const
 
bool isStopped () const
 
bool isWaiting () const
 
bool isWaiting () const
 
ControllerBaseoperator= (const ControllerBase &)=delete
 
ControllerBaseoperator= (ControllerBase &&)=delete
 
bool startRequest (const ros::Time &time)
 
bool startRequest (const ros::Time &time)
 
bool stopRequest (const ros::Time &time)
 
bool stopRequest (const ros::Time &time)
 
void updateRequest (const ros::Time &time, const ros::Duration &period)
 
void updateRequest (const ros::Time &time, const ros::Duration &period)
 
virtual void waiting (const ros::Time &)
 
virtual void waiting (const ros::Time &)
 
bool waitRequest (const ros::Time &time)
 
bool waitRequest (const ros::Time &time)
 
virtual ~ControllerBase ()=default
 

Private Attributes

ros::Duration elapsed_time_
 
std::vector< hardware_interface::JointHandlevelocity_joint_handles_
 
hardware_interface::VelocityJointInterfacevelocity_joint_interface_
 

Additional Inherited Members

- Public Types inherited from controller_interface::ControllerBase
typedef std::vector< hardware_interface::InterfaceResourcesClaimedResources
 
- Public Attributes inherited from controller_interface::ControllerBase
 ABORTED
 
 CONSTRUCTED
 
 INITIALIZED
 
 RUNNING
 
enum controller_interface::ControllerBase:: { ... }  state_
 
 STOPPED
 
 WAITING
 
- Protected Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, franka_hw::FrankaStateInterface >
bool initRequest (hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh, ClaimedResources &claimed_resources) override
 
- Static Protected Member Functions inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, franka_hw::FrankaStateInterface >
static void clearClaims (hardware_interface::RobotHW *robot_hw)
 
static void extractInterfaceResources (hardware_interface::RobotHW *robot_hw_in, hardware_interface::RobotHW *robot_hw_out)
 
static bool hasRequiredInterfaces (hardware_interface::RobotHW *robot_hw)
 
static void populateClaimedResources (hardware_interface::RobotHW *robot_hw, ClaimedResources &claimed_resources)
 
- Protected Attributes inherited from controller_interface::MultiInterfaceController< hardware_interface::VelocityJointInterface, franka_hw::FrankaStateInterface >
bool allow_optional_interfaces_
 
hardware_interface::RobotHW robot_hw_ctrl_
 

Detailed Description

Definition at line 17 of file joint_velocity_example_controller.h.

Member Function Documentation

◆ init()

bool franka_example_controllers::JointVelocityExampleController::init ( hardware_interface::RobotHW robot_hardware,
ros::NodeHandle node_handle 
)
overridevirtual

◆ starting()

void franka_example_controllers::JointVelocityExampleController::starting ( const ros::Time )
overridevirtual

Reimplemented from controller_interface::ControllerBase.

Definition at line 78 of file joint_velocity_example_controller.cpp.

◆ stopping()

void franka_example_controllers::JointVelocityExampleController::stopping ( const ros::Time )
overridevirtual

Reimplemented from controller_interface::ControllerBase.

Definition at line 99 of file joint_velocity_example_controller.cpp.

◆ update()

void franka_example_controllers::JointVelocityExampleController::update ( const ros::Time ,
const ros::Duration period 
)
overridevirtual

Member Data Documentation

◆ elapsed_time_

ros::Duration franka_example_controllers::JointVelocityExampleController::elapsed_time_
private

Definition at line 29 of file joint_velocity_example_controller.h.

◆ velocity_joint_handles_

std::vector<hardware_interface::JointHandle> franka_example_controllers::JointVelocityExampleController::velocity_joint_handles_
private

Definition at line 28 of file joint_velocity_example_controller.h.

◆ velocity_joint_interface_

hardware_interface::VelocityJointInterface* franka_example_controllers::JointVelocityExampleController::velocity_joint_interface_
private

Definition at line 27 of file joint_velocity_example_controller.h.


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


franka_example_controllers
Author(s): Franka Emika GmbH
autogenerated on Mon Sep 19 2022 03:06:01