model_example_controller.h
Go to the documentation of this file.
1 // Copyright (c) 2017 Franka Emika GmbH
2 // Use of this source code is governed by the Apache-2.0 license, see LICENSE
3 #pragma once
4 
5 #include <memory>
6 #include <string>
7 
10 #include <ros/node_handle.h>
11 #include <ros/time.h>
12 
15 #include <franka_hw/trigger_rate.h>
16 
18 
20  : public controller_interface::MultiInterfaceController<franka_hw::FrankaModelInterface,
21  franka_hw::FrankaStateInterface> {
22  public:
23  bool init(hardware_interface::RobotHW* robot_hw, ros::NodeHandle& node_handle) override;
24  void update(const ros::Time&, const ros::Duration&) override;
25 
26  private:
28  std::unique_ptr<franka_hw::FrankaStateHandle> franka_state_handle_;
30  std::unique_ptr<franka_hw::FrankaModelHandle> model_handle_;
32 };
33 
34 } // namespace franka_example_controllers
std::unique_ptr< franka_hw::FrankaStateHandle > franka_state_handle_
std::unique_ptr< franka_hw::FrankaModelHandle > model_handle_
bool init(hardware_interface::RobotHW *robot_hw, ros::NodeHandle &node_handle) override
void update(const ros::Time &, const ros::Duration &) override


franka_example_controllers
Author(s): Franka Emika GmbH
autogenerated on Fri Oct 23 2020 03:47:17