-
Notifications
You must be signed in to change notification settings - Fork 197
Commit
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
use node interfaces throughout tf2_ros (#108)
* Use node interface pointers in the TransformListener class In the TransformListener class, use node interfaces instead of using the node directly so that the code works with either rclcpp::Node or rclcpp_lifecycle::LifecycleNode. Retain the existing node-based interface for backwards compatibility. * Format code based on ament_cpplint and ament_uncrustify * use node interfaces consistently Signed-off-by: Karsten Knese <[email protected]> * adher to new rclcpp API Signed-off-by: Karsten Knese <[email protected]> * remove std::forward Signed-off-by: Karsten Knese <[email protected]> * export symbols for windows Signed-off-by: Karsten Knese <[email protected]> * callback also has to be public Signed-off-by: Karsten Knese <[email protected]> * address review Signed-off-by: Karsten Knese <[email protected]> * refactor node wrapper class Signed-off-by: Karsten Knese <[email protected]> * restore latched todo Signed-off-by: Karsten Knese <[email protected]>
- Loading branch information
1 parent
3323ebd
commit db7493c
Showing
11 changed files
with
418 additions
and
133 deletions.
There are no files selected for viewing
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Oops, something went wrong.