Classes | Functions
dsa_only.cpp File Reference

Implementation of ROS node for DSA. More...

#include <unistd.h>
#include <ros/ros.h>
#include <schunk_sdh/TactileSensor.h>
#include <schunk_sdh/TactileMatrix.h>
#include <cob_srvs/Trigger.h>
#include <cob_srvs/SetOperationMode.h>
#include <diagnostic_msgs/DiagnosticArray.h>
#include <diagnostic_msgs/KeyValue.h>
#include <schunk_sdh/dsa.h>
#include <boost/lexical_cast.hpp>
#include <boost/bind.hpp>
Include dependency graph for dsa_only.cpp:

Go to the source code of this file.

Classes

class  DsaNode
 Implementation of ROS node for DSA. More...

Functions

int main (int argc, char **argv)
 Main loop of ROS node.
template<typename T >
bool read_vector (ros::NodeHandle &n_, const std::string &key, std::vector< T > &res)

Detailed Description

Implementation of ROS node for DSA.

Note:
Copyright (c) 2010
Fraunhofer Institute for Manufacturing Engineering and Automation (IPA)

Project name: schunk_modular_robotics
ROS stack name: schunk_modular_robotics
ROS package name: schunk_sdh
Author:
Author: Florian Weisshardt, email:florian.weisshardt@ipa.fhg.de
Supervised by: Florian Weisshardt, email:florian.weisshardt@ipa.fhg.de
Date:
Date of creation: Jan 2010

Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:

This program is free software: you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License LGPL as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.

This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU Lesser General Public License LGPL for more details.

You should have received a copy of the GNU Lesser General Public License LGPL along with this program. If not, see <http://www.gnu.org/licenses/>.

Definition in file dsa_only.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Main loop of ROS node.

Running with a specific frequency defined by loop_rate.

Definition at line 397 of file dsa_only.cpp.

template<typename T >
bool read_vector ( ros::NodeHandle n_,
const std::string &  key,
std::vector< T > &  res 
)

Resize and assign of values to the vector

Definition at line 86 of file dsa_only.cpp.



schunk_sdh
Author(s): Florian Weisshardt
autogenerated on Mon Oct 6 2014 07:29:15