Package Summary

Tags No category tags.
Version 16.0.8
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version humble
Last Updated 2024-01-24
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Ivan Paunovic
  • Jacob Perron
  • William Woodall

Authors

  • Karsten Knese

rclcpp_lifecycle

Package containing a prototype for lifecycle implementation.

Visit the rclcpp_lifecycle API documentation for a complete list of its main components and features. For more information about LifeCycle in ROS 2, see the design document.

Quality Declaration

This package claims to be in the Quality Level 1 category, see the Quality Declaration for more details.

CHANGELOG

Changelog for package rclcpp_lifecycle

16.0.8 (2024-01-24)

16.0.7 (2023-11-13)

16.0.6 (2023-09-19)

16.0.5 (2023-07-17)

  • Fix thread safety in LifecycleNode::get_current_state() for Humble (#2183)
    • add initially-failing test case
    • apply changes to LifecycleNodeInterfaceImpl from #1756
    • add static member to State for managing state_handle_ access
    • allow parallel read access in MutexMap
  • Contributors: Joseph Schornak

16.0.4 (2023-04-25)

16.0.3 (2023-01-10)

16.0.2 (2022-11-07)

16.0.1 (2022-04-13)

16.0.0 (2022-04-08)

  • remove things that were deprecated during galactic (#1913)
  • Contributors: William Woodall

15.4.0 (2022-04-05)

15.3.0 (2022-03-30)

15.2.0 (2022-03-24)

  • Fix rosdoc2 issues (#1897)
  • Contributors: Chris Lalancette

15.1.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#1888)
  • LifecycleNode::on_deactivate deactivate all managed entities. (#1885)
  • Contributors: Shane Loretz, Tomoya Fujita

15.0.0 (2022-01-14)

  • Automatically transition lifecycle entities when node transitions (#1863)
  • Contributors: Ivan Santiago Paunovic

14.1.0 (2022-01-05)

14.0.0 (2021-12-17)

  • Remove author by request (#1818)
  • Update maintainers (#1817)
  • Suppress clang dead-store warnings in the benchmarks. (#1802)
  • Contributors: Chris Lalancette, Jacob Perron

13.1.0 (2021-10-18)

  • Update forward declarations of [rcl_lifecycle]{.title-ref} types (#1788)
  • Deprecate the [void shared_ptr<MessageT>]{.title-ref} subscription callback signatures (#1713)
  • Contributors: Abrar Rahman Protyasha, Michel Hidalgo

13.0.0 (2021-08-23)

  • Update client API to be able to remove pending requests. (#1734)
  • Change log level for lifecycle_publisher. (#1715)
  • Fix: RCLCPP_PUBLIC -> RCLCPP_LIFECYCLE_PUBLIC (#1732)
  • Use rcpputils/scope_exit.hpp and remove rclcpp/scope_exit.hpp (#1727)
  • Contributors: Alberto Soragna, Christophe Bedard, Ivan Santiago Paunovic, Shane Loretz

12.0.0 (2021-07-26)

  • Remove unsafe get_callback_groups API. Callers should change to using for_each_callback_group(), or store the callback groups they need internally.
  • Add in callback_groups_for_each. The main reason to add this method in is to make accesses to the callback_groups_ vector thread-safe. By having a callback_groups_for_each that accepts a std::function, we can just have the callers give us the callback they are interested in, and we can take care of the locking. The rest of this fairly large PR is cleaning up all of the places that use get_callback_groups() to instead use callback_groups_for_each().
  • Contributors: Chris Lalancette

11.2.0 (2021-07-21)

11.1.0 (2021-07-13)

11.0.0 (2021-05-18)

  • Fix destruction order in lifecycle benchmark (#1675)
  • Contributors: Scott K Logan

10.0.0 (2021-05-11)

  • [rclcpp] Type Adaptation feature (#1557)
  • Contributors: Audrow Nash, William Woodall

9.0.2 (2021-04-14)

9.0.1 (2021-04-12)

9.0.0 (2021-04-06)

  • Add generic publisher and generic subscription for serialized messages (#1452)
  • updating quality declaration links (re: ros2/docs.ros2.org#52) (#1615)
  • Contributors: Nikolai Morin, shonigmann

8.2.0 (2021-03-31)

  • Fix flaky lifecycle node tests (#1606)
  • Clock subscription callback group spins in its own thread (#1556)
  • Delete debug messages (#1602)
  • add automatically_add_executor_with_node option (#1594)
  • Contributors: BriceRenaudeau, Ivan Santiago Paunovic, Jacob Perron, anaelle-sw

8.1.0 (2021-03-25)

8.0.0 (2021-03-23)

  • make rcl_lifecyle_com_interface optional in lifecycle nodes (#1507)
  • Contributors: Karsten Knese

7.0.1 (2021-03-22)

7.0.0 (2021-03-18)

  • Add support for rmw_connextdds (#1574)
  • Fix SEGV caused by order of destruction of Node sub-interfaces (#1469)
  • Enforce static parameter types (#1522)
  • Contributors: Andrea Sorbini, Colin MacKenzie, Ivan Santiago Paunovic

6.3.1 (2021-02-08)

6.3.0 (2021-01-25)

6.2.0 (2021-01-08)

6.1.0 (2020-12-10)

  • add LifecycleNode::get_transition_graph to match services. (#1472)
  • Update QDs to QL 1 (#1477)
  • Benchmark lifecycle features (#1462)
  • Contributors: Stephen Brawner, brawner, tomoya

6.0.0 (2020-11-18)

  • Reserve vector capacities and use emplace_back for constructing vectors (#1464)
  • [rclcpp_lifecycle] Change uint8_t iterator variables to size_t (#1461)
  • Bump rclcpp packages to Quality Level 2 (#1445)
  • Contributors: Louise Poubel, brawner

5.1.0 (2020-11-02)

  • Increase test timeouts of slow running tests with rmw_connext_cpp (#1400)
  • Update maintainers (#1384)
  • Add clock qos to node options (#1375)
  • Contributors: Ivan Santiago Paunovic, brawner

5.0.0 (2020-09-18)

  • Increase test coverage of rclcpp_lifecycle to 96% (#1298)
  • Log error instead of throwing exception in Transition and State reset(), mark no except (#1297)
  • Remove unused private function (rclcpp::Node and rclcpp_lifecycle::Node) (#1294)
  • Remove rmw-dependent unit-test checks (#1293)
  • Added missing tests for rclcpp lifecycle (#1240)
  • Warn about unused result of add_on_set_parameters_callback (#1238)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
control_toolbox github-ros-controls-control_toolbox
diagnostic_updater github-ros-diagnostics
fmi_adapter github-boschresearch-fmi_adapter
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
pal_statistics github-pal-robotics-pal_statistics
raspimouse_fake github-rt-net-raspimouse_sim
rt_usb_9axisimu_driver github-rt-net-rt_usb_9axisimu_driver
ur_controllers github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
aruco_opencv github-fictionlab-ros_aruco_opencv
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
lifecycle github-ros2-demos
dynamixel_hardware github-dynamixel-community-dynamixel_hardware
message_filters github-ros2-message_filters
nav2_behavior_tree github-ros-planning-navigation2
nav2_behaviors github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_planner github-ros-planning-navigation2
nav2_rviz_plugins github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
raspimouse github-rt-net-raspimouse2
raspimouse_ros2_examples github-rt-net-raspimouse_ros2_examples
controller_interface github-ros-controls-ros2_control
hardware_interface github-ros-controls-ros2_control
hardware_interface_testing github-ros-controls-ros2_control
joint_limits github-ros-controls-ros2_control
ackermann_steering_controller github-ros-controls-ros2_controllers
admittance_controller github-ros-controls-ros2_controllers
bicycle_steering_controller github-ros-controls-ros2_controllers
diff_drive_controller github-ros-controls-ros2_controllers
force_torque_sensor_broadcaster github-ros-controls-ros2_controllers
forward_command_controller github-ros-controls-ros2_controllers
imu_sensor_broadcaster github-ros-controls-ros2_controllers
joint_state_broadcaster github-ros-controls-ros2_controllers
joint_trajectory_controller github-ros-controls-ros2_controllers
range_sensor_broadcaster github-ros-controls-ros2_controllers
steering_controllers_library github-ros-controls-ros2_controllers
tricycle_controller github-ros-controls-ros2_controllers
tricycle_steering_controller github-ros-controls-ros2_controllers
ros2_ouster github-SteveMacenski-ros2_ouster_drivers
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_core github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tools github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
test_tracetools github-ros2-ros2_tracing
ros2lifecycle_test_fixtures github-ros2-ros2cli
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
lifecyclenode_client github-robosoft-ai-SMACC2
nav2z_planners_common github-robosoft-ai-SMACC2
stubborn_buddies github-open-rmf-stubborn_buddies
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_launch_system_modes github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
webots_ros2_control github-cyberbotics-webots_ros2
qb_softhand_industry_ros2_control bitbucket-qbrobotics-qbshin-ros
generate_parameter_library github-PickNikRobotics-generate_parameter_library
ign_ros2_control github-ros-controls-gz_ros2_control
kinematics_interface github-ros-controls-kinematics_interface
canopen_402_driver github-ros-industrial-ros2_canopen
canopen_base_driver github-ros-industrial-ros2_canopen
canopen_core github-ros-industrial-ros2_canopen
canopen_fake_slaves github-ros-industrial-ros2_canopen
canopen_master_driver github-ros-industrial-ros2_canopen
canopen_proxy_driver github-ros-industrial-ros2_canopen
canopen_ros2_control github-ros-industrial-ros2_canopen
canopen_ros2_controllers github-ros-industrial-ros2_canopen
robotiq_driver github-PickNikRobotics-ros2_robotiq_gripper
sick_safevisionary_driver github-SICKAG-sick_safevisionary_ros2
as2_core github-aerostack2-aerostack2
andino_base github-Ekumen-OS-andino
mocap4r2_control github-MOCAP4ROS2-Project-mocap4r2
mocap4r2_dummy_driver github-MOCAP4ROS2-Project-mocap4r2
play_motion2 github-pal-robotics-play_motion2
psdk_wrapper github-umdlife-psdk_ros2
robotont_driver github-robotont-robotont_driver
sicks300_2 github-ajtudela-sicks300_2

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 21.0.5
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version iron
Last Updated 2024-02-07
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Ivan Paunovic
  • Michel Hidalgo
  • William Woodall

Authors

  • Jacob Perron
  • Karsten Knese

rclcpp_lifecycle

Package containing a prototype for lifecycle implementation.

Visit the rclcpp_lifecycle API documentation for a complete list of its main components and features. For more information about LifeCycle in ROS 2, see the design document.

Quality Declaration

This package claims to be in the Quality Level 1 category, see the Quality Declaration for more details.

CHANGELOG

Changelog for package rclcpp_lifecycle

21.0.5 (2024-02-07)

21.0.4 (2023-11-17)

21.0.3 (2023-09-08)

  • Switch lifecycle to use the RCLCPP macros. (#2244)
  • Add new node interface TypeDescriptionsInterface to provide GetTypeDescription service (#2236)
  • Contributors: Emerson Knapp

21.0.2 (2023-07-14)

21.0.1 (2023-05-11)

21.0.0 (2023-04-18)

  • Add support for logging service. (#2122)
  • Support publishing loaned messages in LifecyclePublisher (#2159)
  • Contributors: Lei Liu, Michael Babenko

20.0.0 (2023-04-13)

  • Fixes to silence some clang warnings. (#2127)
  • Update all rclcpp packages to C++17. (#2121)
  • Use the correct macro for LifecycleNode::get_fully_qualified_name (#2117)
  • add get_fully_qualified_name to rclcpp_lifecycle (#2115)
  • Contributors: Chris Lalancette, Steve Macenski

19.3.0 (2023-03-01)

19.2.0 (2023-02-24)

19.1.0 (2023-02-14)

19.0.0 (2023-01-30)

18.0.0 (2022-12-29)

  • Implement Unified Node Interface (NodeInterfaces class) (#2041)
  • Add clock type to node_options (#1982)
  • Update maintainers (#2043)
  • Contributors: Audrow Nash, Jeffery Hsu, methylDragon

17.1.0 (2022-11-02)

  • LifecycleNode on_configure doc fix. (#2034)
  • Bugfix 20210810 get current state (#1756)
  • Make lifecycle impl get_current_state() const. (#2031)
  • Cleanup the lifecycle implementation (#2027)
  • Cleanup the rclcpp_lifecycle dependencies. (#2021)
  • Contributors: Chris Lalancette, Tomoya Fujita

17.0.0 (2022-09-13)

  • Revert \"Revert \"Add a create_timer method to Node and [LifecycleNode]{.title-ref} classes (#1975)\" (#2009) (#2010)
  • Revert \"Add a [create_timer]{.title-ref} method to [Node]{.title-ref} and [LifecycleNode]{.title-ref} classes (#1975)\" (#2009)
  • Add a [create_timer]{.title-ref} method to [Node]{.title-ref} and [LifecycleNode]{.title-ref} classes (#1975)
  • Support pre-set and post-set parameter callbacks in addition to on-set-parameter-callback. (#1947)
  • Make create_service accept rclcpp::QoS (#1969)
  • Make create_client accept rclcpp::QoS (#1964)
  • Contributors: Andrew Symington, Deepanshu Bansal, Ivan Santiago Paunovic, Shane Loretz

16.2.0 (2022-05-03)

16.1.0 (2022-04-29)

16.0.1 (2022-04-13)

16.0.0 (2022-04-08)

  • remove things that were deprecated during galactic (#1913)
  • Contributors: William Woodall

15.4.0 (2022-04-05)

15.3.0 (2022-03-30)

15.2.0 (2022-03-24)

  • Fix rosdoc2 issues (#1897)
  • Contributors: Chris Lalancette

15.1.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#1888)
  • LifecycleNode::on_deactivate deactivate all managed entities. (#1885)
  • Contributors: Shane Loretz, Tomoya Fujita

15.0.0 (2022-01-14)

  • Automatically transition lifecycle entities when node transitions (#1863)
  • Contributors: Ivan Santiago Paunovic

14.1.0 (2022-01-05)

14.0.0 (2021-12-17)

  • Remove author by request (#1818)
  • Update maintainers (#1817)
  • Suppress clang dead-store warnings in the benchmarks. (#1802)
  • Contributors: Chris Lalancette, Jacob Perron

13.1.0 (2021-10-18)

  • Update forward declarations of [rcl_lifecycle]{.title-ref} types (#1788)
  • Deprecate the [void shared_ptr<MessageT>]{.title-ref} subscription callback signatures (#1713)
  • Contributors: Abrar Rahman Protyasha, Michel Hidalgo

13.0.0 (2021-08-23)

  • Update client API to be able to remove pending requests. (#1734)
  • Change log level for lifecycle_publisher. (#1715)
  • Fix: RCLCPP_PUBLIC -> RCLCPP_LIFECYCLE_PUBLIC (#1732)
  • Use rcpputils/scope_exit.hpp and remove rclcpp/scope_exit.hpp (#1727)
  • Contributors: Alberto Soragna, Christophe Bedard, Ivan Santiago Paunovic, Shane Loretz

12.0.0 (2021-07-26)

  • Remove unsafe get_callback_groups API. Callers should change to using for_each_callback_group(), or store the callback groups they need internally.
  • Add in callback_groups_for_each. The main reason to add this method in is to make accesses to the callback_groups_ vector thread-safe. By having a callback_groups_for_each that accepts a std::function, we can just have the callers give us the callback they are interested in, and we can take care of the locking. The rest of this fairly large PR is cleaning up all of the places that use get_callback_groups() to instead use callback_groups_for_each().
  • Contributors: Chris Lalancette

11.2.0 (2021-07-21)

11.1.0 (2021-07-13)

11.0.0 (2021-05-18)

  • Fix destruction order in lifecycle benchmark (#1675)
  • Contributors: Scott K Logan

10.0.0 (2021-05-11)

  • [rclcpp] Type Adaptation feature (#1557)
  • Contributors: Audrow Nash, William Woodall

9.0.2 (2021-04-14)

9.0.1 (2021-04-12)

9.0.0 (2021-04-06)

  • Add generic publisher and generic subscription for serialized messages (#1452)
  • updating quality declaration links (re: ros2/docs.ros2.org#52) (#1615)
  • Contributors: Nikolai Morin, shonigmann

8.2.0 (2021-03-31)

  • Fix flaky lifecycle node tests (#1606)
  • Clock subscription callback group spins in its own thread (#1556)
  • Delete debug messages (#1602)
  • add automatically_add_executor_with_node option (#1594)
  • Contributors: BriceRenaudeau, Ivan Santiago Paunovic, Jacob Perron, anaelle-sw

8.1.0 (2021-03-25)

8.0.0 (2021-03-23)

  • make rcl_lifecyle_com_interface optional in lifecycle nodes (#1507)
  • Contributors: Karsten Knese

7.0.1 (2021-03-22)

7.0.0 (2021-03-18)

  • Add support for rmw_connextdds (#1574)
  • Fix SEGV caused by order of destruction of Node sub-interfaces (#1469)
  • Enforce static parameter types (#1522)
  • Contributors: Andrea Sorbini, Colin MacKenzie, Ivan Santiago Paunovic

6.3.1 (2021-02-08)

6.3.0 (2021-01-25)

6.2.0 (2021-01-08)

6.1.0 (2020-12-10)

  • add LifecycleNode::get_transition_graph to match services. (#1472)
  • Update QDs to QL 1 (#1477)
  • Benchmark lifecycle features (#1462)
  • Contributors: Stephen Brawner, brawner, tomoya

6.0.0 (2020-11-18)

  • Reserve vector capacities and use emplace_back for constructing vectors (#1464)
  • [rclcpp_lifecycle] Change uint8_t iterator variables to size_t (#1461)
  • Bump rclcpp packages to Quality Level 2 (#1445)
  • Contributors: Louise Poubel, brawner

5.1.0 (2020-11-02)

  • Increase test timeouts of slow running tests with rmw_connext_cpp (#1400)
  • Update maintainers (#1384)
  • Add clock qos to node options (#1375)
  • Contributors: Ivan Santiago Paunovic, brawner

5.0.0 (2020-09-18)

  • Increase test coverage of rclcpp_lifecycle to 96% (#1298)
  • Log error instead of throwing exception in Transition and State reset(), mark no except (#1297)
  • Remove unused private function (rclcpp::Node and rclcpp_lifecycle::Node) (#1294)
  • Remove rmw-dependent unit-test checks (#1293)
  • Added missing tests for rclcpp lifecycle (#1240)
  • Warn about unused result of add_on_set_parameters_callback (#1238)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
control_toolbox github-ros-controls-control_toolbox
diagnostic_updater github-ros-diagnostics
fmi_adapter github-boschresearch-fmi_adapter
camera_info_manager github-ros-perception-image_common
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
ur_controllers github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
aruco_opencv github-fictionlab-ros_aruco_opencv
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
lifecycle github-ros2-demos
dynamixel_hardware github-dynamixel-community-dynamixel_hardware
message_filters github-ros2-message_filters
nav2_behavior_tree github-ros-planning-navigation2
nav2_behaviors github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_planner github-ros-planning-navigation2
nav2_rviz_plugins github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
controller_interface github-ros-controls-ros2_control
hardware_interface github-ros-controls-ros2_control
hardware_interface_testing github-ros-controls-ros2_control
joint_limits github-ros-controls-ros2_control
ackermann_steering_controller github-ros-controls-ros2_controllers
admittance_controller github-ros-controls-ros2_controllers
bicycle_steering_controller github-ros-controls-ros2_controllers
diff_drive_controller github-ros-controls-ros2_controllers
force_torque_sensor_broadcaster github-ros-controls-ros2_controllers
forward_command_controller github-ros-controls-ros2_controllers
imu_sensor_broadcaster github-ros-controls-ros2_controllers
joint_state_broadcaster github-ros-controls-ros2_controllers
joint_trajectory_controller github-ros-controls-ros2_controllers
range_sensor_broadcaster github-ros-controls-ros2_controllers
steering_controllers_library github-ros-controls-ros2_controllers
tricycle_controller github-ros-controls-ros2_controllers
tricycle_steering_controller github-ros-controls-ros2_controllers
plansys2_bt_actions github-PlanSys2-ros2_planning_system
plansys2_core github-PlanSys2-ros2_planning_system
plansys2_domain_expert github-PlanSys2-ros2_planning_system
plansys2_executor github-PlanSys2-ros2_planning_system
plansys2_lifecycle_manager github-PlanSys2-ros2_planning_system
plansys2_planner github-PlanSys2-ros2_planning_system
plansys2_problem_expert github-PlanSys2-ros2_planning_system
plansys2_terminal github-PlanSys2-ros2_planning_system
plansys2_tests github-PlanSys2-ros2_planning_system
plansys2_tools github-PlanSys2-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
test_tracetools github-ros2-ros2_tracing
ros2lifecycle_test_fixtures github-ros2-ros2cli
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
nav2z_planners_common github-robosoft-ai-SMACC2
stubborn_buddies github-open-rmf-stubborn_buddies
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_launch_system_modes github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
webots_ros2_control github-cyberbotics-webots_ros2
generate_parameter_library github-PickNikRobotics-generate_parameter_library
gz_ros2_control github-ros-controls-gz_ros2_control
kinematics_interface github-ros-controls-kinematics_interface
ouster_ros github-ouster-lidar-ouster-ros
robotiq_driver github-PickNikRobotics-ros2_robotiq_gripper
sick_safevisionary_driver github-SICKAG-sick_safevisionary_ros2
opennav_coverage github-open-navigation-opennav_coverage
opennav_coverage_msgs github-open-navigation-opennav_coverage

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 27.0.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version rolling
Last Updated 2024-03-06
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Ivan Paunovic
  • Michel Hidalgo
  • William Woodall

Authors

  • Jacob Perron
  • Karsten Knese

rclcpp_lifecycle

Package containing a prototype for lifecycle implementation.

The link to the latest rclcpp_lifecycle API documentation, which includes a complete list of its main components and features, can be found on the rclcpp_lifecycle package info page, at the ROS Index. For more information about LifeCycle in ROS 2, see the design document.

Quality Declaration

This package claims to be in the Quality Level 1 category, see the Quality Declaration for more details.

CHANGELOG

Changelog for package rclcpp_lifecycle

27.0.0 (2024-02-07)

26.0.0 (2024-01-24)

  • Increase timeout for rclcpp_lifecycle to 360 (#2395)
  • Contributors: Jorge Perez

25.0.0 (2023-12-26)

24.0.0 (2023-11-06)

  • Fix rclcpp_lifecycle inclusion on Windows. (#2331)
  • Contributors: Chris Lalancette

23.2.0 (2023-10-09)

  • add clients & services count (#2072)
  • Contributors: Minju, Lee

23.1.0 (2023-10-04)

23.0.0 (2023-09-08)

  • Update API docs links in package READMEs (#2302)
  • Contributors: Christophe Bedard

22.2.0 (2023-09-07)

  • add logger level service to lifecycle node. (#2277)
  • Contributors: Tomoya Fujita

22.1.0 (2023-08-21)

  • Stop using constref signature of benchmark DoNotOptimize. (#2238)
  • Contributors: Chris Lalancette

22.0.0 (2023-07-11)

  • Implement get_node_type_descriptions_interface for lifecyclenode and add smoke test for it (#2237)
  • Switch lifecycle to use the RCLCPP macros. (#2233)
  • Add new node interface TypeDescriptionsInterface to provide GetTypeDescription service (#2224)
  • Contributors: Chris Lalancette, Emerson Knapp

21.3.0 (2023-06-12)

21.2.0 (2023-06-07)

21.1.1 (2023-05-11)

21.1.0 (2023-04-27)

21.0.0 (2023-04-18)

  • Add support for logging service. (#2122)
  • Support publishing loaned messages in LifecyclePublisher (#2159)
  • Contributors: Lei Liu, Michael Babenko

20.0.0 (2023-04-13)

  • Fixes to silence some clang warnings. (#2127)
  • Update all rclcpp packages to C++17. (#2121)
  • Use the correct macro for LifecycleNode::get_fully_qualified_name (#2117)
  • add get_fully_qualified_name to rclcpp_lifecycle (#2115)
  • Contributors: Chris Lalancette, Steve Macenski

19.3.0 (2023-03-01)

19.2.0 (2023-02-24)

19.1.0 (2023-02-14)

19.0.0 (2023-01-30)

18.0.0 (2022-12-29)

  • Implement Unified Node Interface (NodeInterfaces class) (#2041)
  • Add clock type to node_options (#1982)
  • Update maintainers (#2043)
  • Contributors: Audrow Nash, Jeffery Hsu, methylDragon

17.1.0 (2022-11-02)

  • LifecycleNode on_configure doc fix. (#2034)
  • Bugfix 20210810 get current state (#1756)
  • Make lifecycle impl get_current_state() const. (#2031)
  • Cleanup the lifecycle implementation (#2027)
  • Cleanup the rclcpp_lifecycle dependencies. (#2021)
  • Contributors: Chris Lalancette, Tomoya Fujita

17.0.0 (2022-09-13)

  • Revert \"Revert \"Add a create_timer method to Node and [LifecycleNode]{.title-ref} classes (#1975)\" (#2009) (#2010)
  • Revert \"Add a [create_timer]{.title-ref} method to [Node]{.title-ref} and [LifecycleNode]{.title-ref} classes (#1975)\" (#2009)
  • Add a [create_timer]{.title-ref} method to [Node]{.title-ref} and [LifecycleNode]{.title-ref} classes (#1975)
  • Support pre-set and post-set parameter callbacks in addition to on-set-parameter-callback. (#1947)
  • Make create_service accept rclcpp::QoS (#1969)
  • Make create_client accept rclcpp::QoS (#1964)
  • Contributors: Andrew Symington, Deepanshu Bansal, Ivan Santiago Paunovic, Shane Loretz

16.2.0 (2022-05-03)

16.1.0 (2022-04-29)

16.0.1 (2022-04-13)

16.0.0 (2022-04-08)

  • remove things that were deprecated during galactic (#1913)
  • Contributors: William Woodall

15.4.0 (2022-04-05)

15.3.0 (2022-03-30)

15.2.0 (2022-03-24)

  • Fix rosdoc2 issues (#1897)
  • Contributors: Chris Lalancette

15.1.0 (2022-03-01)

  • Install headers to include/\${PROJECT_NAME} (#1888)
  • LifecycleNode::on_deactivate deactivate all managed entities. (#1885)
  • Contributors: Shane Loretz, Tomoya Fujita

15.0.0 (2022-01-14)

  • Automatically transition lifecycle entities when node transitions (#1863)
  • Contributors: Ivan Santiago Paunovic

14.1.0 (2022-01-05)

14.0.0 (2021-12-17)

  • Remove author by request (#1818)
  • Update maintainers (#1817)
  • Suppress clang dead-store warnings in the benchmarks. (#1802)
  • Contributors: Chris Lalancette, Jacob Perron

13.1.0 (2021-10-18)

  • Update forward declarations of [rcl_lifecycle]{.title-ref} types (#1788)
  • Deprecate the [void shared_ptr<MessageT>]{.title-ref} subscription callback signatures (#1713)
  • Contributors: Abrar Rahman Protyasha, Michel Hidalgo

13.0.0 (2021-08-23)

  • Update client API to be able to remove pending requests. (#1734)
  • Change log level for lifecycle_publisher. (#1715)
  • Fix: RCLCPP_PUBLIC -> RCLCPP_LIFECYCLE_PUBLIC (#1732)
  • Use rcpputils/scope_exit.hpp and remove rclcpp/scope_exit.hpp (#1727)
  • Contributors: Alberto Soragna, Christophe Bedard, Ivan Santiago Paunovic, Shane Loretz

12.0.0 (2021-07-26)

  • Remove unsafe get_callback_groups API. Callers should change to using for_each_callback_group(), or store the callback groups they need internally.
  • Add in callback_groups_for_each. The main reason to add this method in is to make accesses to the callback_groups_ vector thread-safe. By having a callback_groups_for_each that accepts a std::function, we can just have the callers give us the callback they are interested in, and we can take care of the locking. The rest of this fairly large PR is cleaning up all of the places that use get_callback_groups() to instead use callback_groups_for_each().
  • Contributors: Chris Lalancette

11.2.0 (2021-07-21)

11.1.0 (2021-07-13)

11.0.0 (2021-05-18)

  • Fix destruction order in lifecycle benchmark (#1675)
  • Contributors: Scott K Logan

10.0.0 (2021-05-11)

  • [rclcpp] Type Adaptation feature (#1557)
  • Contributors: Audrow Nash, William Woodall

9.0.2 (2021-04-14)

9.0.1 (2021-04-12)

9.0.0 (2021-04-06)

  • Add generic publisher and generic subscription for serialized messages (#1452)
  • updating quality declaration links (re: ros2/docs.ros2.org#52) (#1615)
  • Contributors: Nikolai Morin, shonigmann

8.2.0 (2021-03-31)

  • Fix flaky lifecycle node tests (#1606)
  • Clock subscription callback group spins in its own thread (#1556)
  • Delete debug messages (#1602)
  • add automatically_add_executor_with_node option (#1594)
  • Contributors: BriceRenaudeau, Ivan Santiago Paunovic, Jacob Perron, anaelle-sw

8.1.0 (2021-03-25)

8.0.0 (2021-03-23)

  • make rcl_lifecyle_com_interface optional in lifecycle nodes (#1507)
  • Contributors: Karsten Knese

7.0.1 (2021-03-22)

7.0.0 (2021-03-18)

  • Add support for rmw_connextdds (#1574)
  • Fix SEGV caused by order of destruction of Node sub-interfaces (#1469)
  • Enforce static parameter types (#1522)
  • Contributors: Andrea Sorbini, Colin MacKenzie, Ivan Santiago Paunovic

6.3.1 (2021-02-08)

6.3.0 (2021-01-25)

6.2.0 (2021-01-08)

6.1.0 (2020-12-10)

  • add LifecycleNode::get_transition_graph to match services. (#1472)
  • Update QDs to QL 1 (#1477)
  • Benchmark lifecycle features (#1462)
  • Contributors: Stephen Brawner, brawner, tomoya

6.0.0 (2020-11-18)

  • Reserve vector capacities and use emplace_back for constructing vectors (#1464)
  • [rclcpp_lifecycle] Change uint8_t iterator variables to size_t (#1461)
  • Bump rclcpp packages to Quality Level 2 (#1445)
  • Contributors: Louise Poubel, brawner

5.1.0 (2020-11-02)

  • Increase test timeouts of slow running tests with rmw_connext_cpp (#1400)
  • Update maintainers (#1384)
  • Add clock qos to node options (#1375)
  • Contributors: Ivan Santiago Paunovic, brawner

5.0.0 (2020-09-18)

  • Increase test coverage of rclcpp_lifecycle to 96% (#1298)
  • Log error instead of throwing exception in Transition and State reset(), mark no except (#1297)
  • Remove unused private function (rclcpp::Node and rclcpp_lifecycle::Node) (#1294)
  • Remove rmw-dependent unit-test checks (#1293)
  • Added missing tests for rclcpp lifecycle (#1240)
  • Warn about unused result of add_on_set_parameters_callback (#1238)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
control_toolbox github-ros-controls-control_toolbox
diagnostic_updater github-ros-diagnostics
fmi_adapter github-boschresearch-fmi_adapter
camera_info_manager github-ros-perception-image_common
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
pal_statistics github-pal-robotics-pal_statistics
ur_controllers github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
aruco_opencv github-fictionlab-ros_aruco_opencv
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
lifecycle github-ros2-demos
dynamixel_hardware github-dynamixel-community-dynamixel_hardware
message_filters github-ros2-message_filters
controller_interface github-ros-controls-ros2_control
hardware_interface github-ros-controls-ros2_control
hardware_interface_testing github-ros-controls-ros2_control
joint_limits github-ros-controls-ros2_control
ackermann_steering_controller github-ros-controls-ros2_controllers
admittance_controller github-ros-controls-ros2_controllers
bicycle_steering_controller github-ros-controls-ros2_controllers
diff_drive_controller github-ros-controls-ros2_controllers
force_torque_sensor_broadcaster github-ros-controls-ros2_controllers
forward_command_controller github-ros-controls-ros2_controllers
imu_sensor_broadcaster github-ros-controls-ros2_controllers
joint_state_broadcaster github-ros-controls-ros2_controllers
joint_trajectory_controller github-ros-controls-ros2_controllers
pid_controller github-ros-controls-ros2_controllers
range_sensor_broadcaster github-ros-controls-ros2_controllers
steering_controllers_library github-ros-controls-ros2_controllers
tricycle_controller github-ros-controls-ros2_controllers
tricycle_steering_controller github-ros-controls-ros2_controllers
ros2_ouster github-SteveMacenski-ros2_ouster_drivers
ros2_socketcan github-autowarefoundation-ros2_socketcan
test_tracetools github-ros2-ros2_tracing
ros2lifecycle_test_fixtures github-ros2-ros2cli
nav2z_planners_common github-robosoft-ai-SMACC2
stubborn_buddies github-open-rmf-stubborn_buddies
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_launch_system_modes github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
webots_ros2_control github-cyberbotics-webots_ros2
generate_parameter_library github-PickNikRobotics-generate_parameter_library
gz_ros2_control github-ros-controls-gz_ros2_control
kinematics_interface github-ros-controls-kinematics_interface
ouster_ros github-ouster-lidar-ouster-ros
canopen_402_driver github-ros-industrial-ros2_canopen
canopen_base_driver github-ros-industrial-ros2_canopen
canopen_core github-ros-industrial-ros2_canopen
canopen_fake_slaves github-ros-industrial-ros2_canopen
canopen_master_driver github-ros-industrial-ros2_canopen
canopen_proxy_driver github-ros-industrial-ros2_canopen
canopen_ros2_control github-ros-industrial-ros2_canopen
canopen_ros2_controllers github-ros-industrial-ros2_canopen
robotiq_driver github-PickNikRobotics-ros2_robotiq_gripper
sick_safevisionary_driver github-SICKAG-sick_safevisionary_ros2

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

No version for distro noetic. Known supported distros are highlighted in the buttons above.

rclcpp_lifecycle package from rclcpp repo

rclcpp rclcpp_lifecycle

Package Summary

Tags No category tags.
Version 0.4.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version ardent
Last Updated 2017-12-09
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG
No CHANGELOG found.

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

rclcpp_lifecycle package from rclcpp repo

rclcpp rclcpp_lifecycle

Package Summary

Tags No category tags.
Version 0.5.1
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version bouncy
Last Updated 2018-06-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rclcpp_lifecycle

0.5.0 (2018-06-25)

  • Added functions that allow you to publish serialized messages and received serialized messages in your subscription callback. (#388)
  • Added ability to initialize parameter values in a node with an argument to the Node constructor. (#486)
  • Nodes now autostart the ROS parameter services which let you get, set, and list parameters in a node. (#478)
  • Fixed a bug that occurred when mixing std::shared_ptr and std::bind. (#470)
  • Added ability to pass command line arguments to the Node constructor. (#461)
  • Changed library export order for static linking. (#446)
  • Now depends on ament_cmake_ros. (#444)
  • Updaed code to use logging macros rather than fprintf(). (#439)
  • Contributors: Dirk Thomas, Guillaume Autran, Karsten Knese, Michael Carroll, Mikael Arguedas, Shane Loretz, dhood

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

rclcpp_lifecycle package from rclcpp repo

rclcpp rclcpp_action rclcpp_lifecycle

Package Summary

Tags No category tags.
Version 0.6.5
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version crystal
Last Updated 2019-12-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rclcpp_lifecycle

0.6.5 (2019-12-05)

0.6.4 (2019-04-06)

0.6.3 (2019-02-08)

0.6.2 (2018-12-13)

0.6.1 (2018-12-07)

  • Added node path and time stamp to parameter event message (#584)
  • Refactored init to allow for non-global init (#587)
  • Add class Waitable (#589)
  • Contributors: Dirk Thomas, Jacob Perron, William Woodall, bpwilcox

0.6.0

  • Updated to use new error handling API from rcutils (#577)
  • Deleted TRANSITION_SHUTDOWN (#576)
  • Added a warning when publishing if publisher is not active (#574)
  • Added SMART_PTRS_DEF to LifecyclePublisher (#569)
  • Added service for transition graph (#555)
  • Added semicolons to all RCLCPP and RCUTILS macros. (#565)
  • Fixed and improved documentation (#546)
  • Removed unneeded dependency on std_msgs (#513)
  • Removed use of uninitialized CMake var (#511)
  • Added get_node_names API from node. (#508)
  • Fixed rosidl dependencies (#507)
  • Contributors: Chris Lalancette, Dirk Thomas, Francisco Mart

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.8.5
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version eloquent
Last Updated 2020-12-04
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rclcpp_lifecycle

0.8.5 (2020-12-04)

0.8.4 (2020-01-17)

0.8.3 (2019-11-19)

0.8.2 (2019-11-18)

0.8.1 (2019-10-23)

  • New Intra-Process Communication (#778)
  • Contributors: Alberto Soragna

0.8.0 (2019-09-26)

  • clean up publisher and subscription creation logic (#867)
  • reset error message before setting a new one, embed the original one (#854)
  • remove features and related code which were deprecated in dashing (#852)
  • Fix typo in deprecated warning. (#848)
  • Add line break after first open paren in multiline function call (#785)
  • Fixe error messages not printing to terminal (#777)
  • Add default value to options in LifecycleNode construnctor. Update API documentation. (#775)
  • Contributors: Dan Rose, Dirk Thomas, Esteve Fernandez, Luca Della Vedova, William Woodall, Yathartha Tuladhar

0.7.5 (2019-05-30)

0.7.4 (2019-05-29)

  • Rename parameter options (#745)
  • Contributors: William Woodall

0.7.3 (2019-05-20)

  • Added missing template functionality to lifecycle_node. (#707)
  • Contributors: Michael Jeronimo

0.7.2 (2019-05-08)

  • Added new way to specify QoS settings for publishers and subscriptions. (#713)
  • Deprecated shared_ptr and raw pointer versions of Publisher<T>::publish(). (#709)
  • Implemented API to set callbacks for liveliness and deadline QoS events for publishers and subscriptions. (#695)
  • Changed the IntraProcessManager to be capable of storing shared_ptr<const T> in addition to unique_ptr<T>. (#690)
  • Contributors: M. M, William Woodall, ivanpauno

0.7.1 (2019-04-26)

  • Added read only parameters. (#495)
  • Contributors: Shane Loretz, William Woodall

0.7.0 (2019-04-14)

  • Fixed linter errors in rclcpp_lifecycle. (#672)
  • Added parameter-related templates to LifecycleNode. (#645)
  • Fixed use_sim_time issue on LifeCycleNode. (#651)
  • Updated to use ament_target_dependencies where possible. (#659)
  • Fixed hard-coded duration type representation so int64_t isn\'t assumed. (#648)
  • Added a method to the LifecycleNode class to get the logging interface. (#652)
  • Set Parameter Event Publisher settings #591 (#614)
  • Replaced node constructor arguments with NodeOptions. (#622)
  • Removed dependency on rclpy. (#626)
  • Contributors: Emerson Knapp, Karsten Knese, Michael Carroll, Michael Jeronimo, Vinnam Kim, William Woodall, ivanpauno, rarvolt

0.6.2 (2018-12-13)

0.6.1 (2018-12-07)

  • Added node path and time stamp to parameter event message (#584)
  • Refactored init to allow for non-global init (#587)
  • Add class Waitable (#589)
  • Contributors: Dirk Thomas, Jacob Perron, William Woodall, bpwilcox

0.6.0 (2018-11-19)

  • Updated to use new error handling API from rcutils (#577)
  • Deleted TRANSITION_SHUTDOWN (#576)
  • Added a warning when publishing if publisher is not active (#574)
  • Added SMART_PTRS_DEF to LifecyclePublisher (#569)
  • Added service for transition graph (#555)
  • Added semicolons to all RCLCPP and RCUTILS macros. (#565)
  • Fixed and improved documentation (#546)
  • Removed unneeded dependency on std_msgs (#513)
  • Removed use of uninitialized CMake var (#511)
  • Added get_node_names API from node. (#508)
  • Fixed rosidl dependencies (#507)
  • Contributors: Chris Lalancette, Dirk Thomas, Francisco Mart

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.7.16
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version dashing
Last Updated 2021-05-21
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rclcpp_lifecycle

0.7.16 (2021-05-21)

0.7.15 (2020-11-24)

  • Type conversions fixes. (#901) (#1209)
  • Contributors: Michel Hidalgo, Monika Idzik

0.7.14 (2020-07-10)

  • Fixed doxygen warnings. (#1208)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 9.2.2
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version galactic
Last Updated 2022-12-07
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Ivan Paunovic
  • Mabel Zhang
  • William Woodall

Authors

  • Karsten Knese

rclcpp_lifecycle

Package containing a prototype for lifecycle implementation.

Visit the rclcpp_lifecycle API documentation for a complete list of its main components and features. For more information about LifeCycle in ROS 2, see the design document.

Quality Declaration

This package claims to be in the Quality Level 1 category, see the Quality Declaration for more details.

CHANGELOG

Changelog for package rclcpp_lifecycle

9.2.2 (2022-12-06)

9.2.1 (2022-04-28)

9.2.0 (2021-09-17)

  • Added thread safe for_each_callback_group method (#1741)
  • Contributors: Aditya Pande

9.1.0 (2021-05-20)

  • Fix destruction order in lifecycle benchmark (#1676)
  • Contributors: Scott K Logan

9.0.3 (2021-05-10)

9.0.2 (2021-04-14)

9.0.1 (2021-04-12)

9.0.0 (2021-04-06)

  • Add generic publisher and generic subscription for serialized messages (#1452)
  • updating quality declaration links (re: ros2/docs.ros2.org#52) (#1615)
  • Contributors: Nikolai Morin, shonigmann

8.2.0 (2021-03-31)

  • Fix flaky lifecycle node tests (#1606)
  • Clock subscription callback group spins in its own thread (#1556)
  • Delete debug messages (#1602)
  • add automatically_add_executor_with_node option (#1594)
  • Contributors: BriceRenaudeau, Ivan Santiago Paunovic, Jacob Perron, anaelle-sw

8.1.0 (2021-03-25)

8.0.0 (2021-03-23)

  • make rcl_lifecyle_com_interface optional in lifecycle nodes (#1507)
  • Contributors: Karsten Knese

7.0.1 (2021-03-22)

7.0.0 (2021-03-18)

  • Add support for rmw_connextdds (#1574)
  • Fix SEGV caused by order of destruction of Node sub-interfaces (#1469)
  • Enforce static parameter types (#1522)
  • Contributors: Andrea Sorbini, Colin MacKenzie, Ivan Santiago Paunovic

6.3.1 (2021-02-08)

6.3.0 (2021-01-25)

6.2.0 (2021-01-08)

6.1.0 (2020-12-10)

  • add LifecycleNode::get_transition_graph to match services. (#1472)
  • Update QDs to QL 1 (#1477)
  • Benchmark lifecycle features (#1462)
  • Contributors: Stephen Brawner, brawner, tomoya

6.0.0 (2020-11-18)

  • Reserve vector capacities and use emplace_back for constructing vectors (#1464)
  • [rclcpp_lifecycle] Change uint8_t iterator variables to size_t (#1461)
  • Bump rclcpp packages to Quality Level 2 (#1445)
  • Contributors: Louise Poubel, brawner

5.1.0 (2020-11-02)

  • Increase test timeouts of slow running tests with rmw_connext_cpp (#1400)
  • Update maintainers (#1384)
  • Add clock qos to node options (#1375)
  • Contributors: Ivan Santiago Paunovic, brawner

5.0.0 (2020-09-18)

  • Increase test coverage of rclcpp_lifecycle to 96% (#1298)
  • Log error instead of throwing exception in Transition and State reset(), mark no except (#1297)
  • Remove unused private function (rclcpp::Node and rclcpp_lifecycle::Node) (#1294)
  • Remove rmw-dependent unit-test checks (#1293)
  • Added missing tests for rclcpp lifecycle (#1240)
  • Warn about unused result of add_on_set_parameters_callback (#1238)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
control_toolbox github-ros-controls-control_toolbox
diagnostic_updater github-ros-diagnostics
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
ur_controllers github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
lifecycle github-ros2-demos
ign_ros2_control github-ignitionrobotics-ign_ros2_control
nav2_behavior_tree github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_planner github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_rviz_plugins github-ros-planning-navigation2
nav2_smac_planner github-ros-planning-navigation2
nav2_theta_star_planner github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
controller_interface github-ros-controls-ros2_control
hardware_interface github-ros-controls-ros2_control
diff_drive_controller github-ros-controls-ros2_controllers
force_torque_sensor_broadcaster github-ros-controls-ros2_controllers
forward_command_controller github-ros-controls-ros2_controllers
imu_sensor_broadcaster github-ros-controls-ros2_controllers
joint_state_broadcaster github-ros-controls-ros2_controllers
joint_trajectory_controller github-ros-controls-ros2_controllers
ros2_ouster github-SteveMacenski-ros2_ouster_drivers
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_core github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tools github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
tracetools_test github-ros2-ros2_tracing
ros2lifecycle_test_fixtures github-ros2-ros2cli
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
lifecyclenode_client github-robosoft-ai-SMACC2
stubborn_buddies github-open-rmf-stubborn_buddies
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_launch_system_modes github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
webots_ros2_control github-cyberbotics-webots_ros2

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.4.3
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/rclcpp.git
VCS Type git
VCS Version foxy
Last Updated 2023-05-27
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package containing a prototype for lifecycle implementation

Additional Links

No additional links.

Maintainers

  • Karsten Knese

Authors

No additional authors.

rclcpp_lifecycle

Package containing a prototype for lifecycle implementation.

Visit the rclcpp_lifecycle API documentation for a complete list of its main components and features. For more information about LifeCycle in ROS 2, see the design document.

Quality Declaration

This package claims to be in the Quality Level 1 category, see the Quality Declaration for more details.

CHANGELOG

Changelog for package rclcpp_lifecycle

2.4.3 (2023-05-27)

2.4.2 (2022-07-25)

2.4.1 (2022-01-31)

2.4.0 (2021-09-01)

  • Fix SEGV caused by order of destruction of Node sub-interfaces (#1469) (#1736)
  • Contributors: Colin MacKenzie

2.3.1 (2021-04-14)

2.3.0 (2020-12-09)

  • Reserve vector capacities and use emplace_back for constructing vectors (#1464) (#1489)
  • Change uint8_t iterator variables to size_t (#1461) (#1488)
  • Update QD to QL 1 (#1480)
  • Benchmark lifecycle features (#1462) (#1471)
  • Fix race in test_lifecycle_service_client (#1204)
  • Increase test coverage of rclcpp_lifecycle to 96% (#1298)
  • Add missing tests for rclcpp lifecycle (#1240)
  • Contributors: Alejandro Hern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
control_toolbox github-ros-controls-control_toolbox
diagnostic_updater github-ros-diagnostics
fmi_adapter github-boschresearch-fmi_adapter
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
wiimote github-ros-drivers-joystick_drivers
laser_filters github-ros-perception-laser_filters
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
rt_usb_9axisimu_driver github-rt-net-rt_usb_9axisimu_driver
ur_controllers github-UniversalRobots-Universal_Robots_ROS2_Driver
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS2_Driver
aruco_opencv github-fictionlab-ros_aruco_opencv
rclcpp_cascade_lifecycle github-fmrico-cascade_lifecycle
lifecycle github-ros2-demos
maliput_ros github-maliput-maliput_ros
nav2_behavior_tree github-ros-planning-navigation2
nav2_bt_navigator github-ros-planning-navigation2
nav2_core github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
nav2_lifecycle_manager github-ros-planning-navigation2
nav2_map_server github-ros-planning-navigation2
nav2_navfn_planner github-ros-planning-navigation2
nav2_planner github-ros-planning-navigation2
nav2_recoveries github-ros-planning-navigation2
nav2_rviz_plugins github-ros-planning-navigation2
nav2_util github-ros-planning-navigation2
nav2_waypoint_follower github-ros-planning-navigation2
smac_planner github-ros-planning-navigation2
raspimouse github-rt-net-raspimouse2
raspimouse_ros2_examples github-rt-net-raspimouse_ros2_examples
controller_interface github-ros-controls-ros2_control
diff_drive_controller github-ros-controls-ros2_controllers
force_torque_sensor_broadcaster github-ros-controls-ros2_controllers
forward_command_controller github-ros-controls-ros2_controllers
imu_sensor_broadcaster github-ros-controls-ros2_controllers
joint_state_broadcaster github-ros-controls-ros2_controllers
joint_trajectory_controller github-ros-controls-ros2_controllers
tricycle_controller github-ros-controls-ros2_controllers
ros2_ouster github-SteveMacenski-ros2_ouster_drivers
plansys2_bt_actions github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_core github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_domain_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_executor github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_lifecycle_manager github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_planner github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_problem_expert github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_terminal github-IntelligentRoboticsLabs-ros2_planning_system
plansys2_tests github-IntelligentRoboticsLabs-ros2_planning_system
ros2_socketcan github-autowarefoundation-ros2_socketcan
ros2lifecycle_test_fixtures github-ros2-ros2cli
sick_safetyscanners2 github-SICKAG-sick_safetyscanners2
stubborn_buddies github-open-rmf-stubborn_buddies
system_metrics_collector github-ros-tooling-system_metrics_collector
system_modes github-micro-ROS-system_modes
system_modes_examples github-micro-ROS-system_modes
test_launch_system_modes github-micro-ROS-system_modes
serial_driver github-ros-drivers-transport_drivers
udp_driver github-ros-drivers-transport_drivers
ros_core github-ros2-variants
webots_ros2_control github-cyberbotics-webots_ros2

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rclcpp_lifecycle at Robotics Stack Exchange

No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.